Hello everyone,
I’ve been looking at adding my own custom airframe to the px4 simulation files and I believe I am close to being successful, however when I run the make command to start the simulation
make px4_sitl gazebo-classic_custom_airframe
it appears to work as intended, but then gets stuck and says
[Msg] Waiting for master.
[Err] [ConnectionManager.cc:121] Failed to connect to master in 30 seconds.
[Err] [gazebo_shared.cc:78] Unable to initialize transport.
[Err] [gazebo_client.cc:56] Unable to setup Gazebo
Additional information:
- Using the current up to date version of the PX4-Autopilot main branch
- Working on Ubuntu 20.04 with ROS2 Foxy
- Followed the steps detailed here to set up my custom_airframe
- I have been able to run the gazebo-classic simulator with the pre-made models (iris) before.
Any help is appreciated, Thanks!