SwiftGust / ardupilot_gazebo

Repository for ArduPilot & Gazebo Software In Loop Simulation Interfaces, Models
74 stars 90 forks source link

Problem with Irlock world #33

Open stokekld opened 3 years ago

stokekld commented 3 years ago

Hi,

I'm trying to simulate the iris_irlock_demo world to test the irlock in action. I’ve installed ubuntu 18.04 with all prerequisite that ardupilot needs. I’ve followed ardupilot instructions to work with gazebo and I’ve installed this repo.

I run gazebo(9) with the next line: gazebo --verbose gazebo_worlds/iris_irlock_demo.world

And ardupilot with the next line from the ArduCopter directory: …/Tools/autotest/sim_vehicle.py -f gazebo-iris --console --map

In the simulation I takeoff the drone and change to mode land but the drone never achieve to see the beacon and lands in other position.

this is the output from gazebo:

Gazebo multi-robot simulator, version 9.16.0
Copyright (C) 2012 Open Source Robotics Foundation.
Released under the Apache 2 License.
http://gazebosim.org

Gazebo multi-robot simulator, version 9.16.0
Copyright (C) 2012 Open Source Robotics Foundation.
Released under the Apache 2 License.
http://gazebosim.org

[Msg] Waiting for master.
[Msg] Waiting for master.
[Msg] Connected to gazebo master @ http://127.0.0.1:11345
[Msg] Publicized address: 192.168.1.72
[Msg] Connected to gazebo master @ http://127.0.0.1:11345
[Msg] Publicized address: 192.168.1.72
[Msg] Loading world file [/home/jesus/Documents/SkySolutions/ardupilot_gazebo/worlds/iris_irlock_demo.world]
[Err] [InsertModelWidget.cc:426] Missing model.config for model "/home/jesus/Documents/SkySolutions/ardupilot_gazebo/models/.hg"

am I working in the rigth way?

SwiftGust commented 3 years ago

Hi, I tested irlock world in ardupilot and doesn't work too. As far as I look into, irlock plugin in this repository works same as usual. It seems something have changed in ArduPilot side, which I need further investigation