I’m pretty new to the world of drones but have chosen drone cyber security as my master’s thesis, so I’m trying to familiarize myself and get some basic sims running. I spun up a new Ubuntu VM and ran through the instructions at Ubuntu Development Environment | PX4 Guide (main) and Binary Installation on Ubuntu — Gazebo harmonic documentation to get PX4 and Gazebo installed without running into any issues. But as soon as I try to run a sim, it errors out:
droney@dronez:~/PX4-Autopilot$ make px4_sitl gz_x500
[1/1] cd /home/droney/PX4-Autopilot/bu…ll_ubuntu/" && /usr/bin/cmake -E false
FAILED: src/modules/simulation/gz_bridge/CMakeFiles/gz_x500 /home/droney/PX4-Autopilot/build/px4_sitl_default/src/modules/simulation/gz_bridge/CMakeFiles/gz_x500
cd /home/droney/PX4-Autopilot/build/px4_sitl_default/src/modules/simulation/gz_bridge && /usr/bin/cmake -E echo “ERROR: Gazebo simulation dependencies not found!” && /usr/bin/cmake -E echo " - For installation instructions, see: Binary Installation on Ubuntu — Gazebo harmonic documentation " && /usr/bin/cmake -E false
ERROR: Gazebo simulation dependencies not found!
- For installation instructions, see: Binary Installation on Ubuntu — Gazebo harmonic documentation
ninja: build stopped: subcommand failed.
make: *** [Makefile:227: px4_sitl] Error 1
I’ve tried uninstalling and reinstalling Gazebo but it didn’t change anything. I checked the CMakeFile directory it’s linking to and it’s empty, but I’m not sure if it’s supposed to be empty and resources are created on sim start or I’m missing something there. Any guidance would be appreciated.