PX4 Gazebo HITL - No Drone Appears When Launching Gazebo

asked 2020-12-17 10:14:37 -0500

I have followed all instructions here: https://dev.px4.io/master/en/simulati... attempting to get a very simple HITL sim running. I have pixhawk 4, running on Ubuntu 18.04 with the latest github firmware. After following all of the steps, when executing the command: gazebo Tools/sitl_gazebo/worlds/iris.world with PIxhawk 4 plugged in via USB, Gazebo is launched, but an empty world is shown. Also, the flight controller does not blink or make any noises. When attempting the command: ./Tools/jmavsim_run.sh -q -s -d /dev/ttyACM0 -b 921600 -r 250, the simulation runs fine and the drone can be moved with the RC or QGroundControl. Any ideas why the drone would not show up in a HITL simulation for Gazebo? After browsing some forums, i attempted this command: GAZEBO_MODEL_PATH=${GAZEBO_MODEL_PATH}:/home/my_user/my_catkin_ws/src/, which did not seem to make a difference. Thank you for any guidance you can give.

edit retag flag offensive close merge delete

Comments

It might help to pass extra_gazebo_args:="--verbose" to roslaunch to get some error messages from Gazebo.

Carlos Agüero gravatar imageCarlos Agüero ( 2020-12-18 13:07:19 -0500 )edit