PX4-SITL stopped working with Gazebo Garden

Hello,

today I updated my system via sudo apt upgrade and since then my px4-SITL stopped working.
Everytime I get this as an outcome:

luky@laptop:~/px4-SITL/PX4-Autopilot$ make px4_sitl gz_x500
[0/1] cd /home/luky/px4-SITL/PX4-Autop...topilot/build/px4_sitl_default/bin/px4

______  __   __    ___ 
| ___ \ \ \ / /   /   |
| |_/ /  \ V /   / /| |
|  __/   /   \  / /_| |
| |     / /^\ \ \___  |
\_|     \/   \/     |_/

px4 starting.

INFO  [px4] startup script: /bin/sh etc/init.d-posix/rcS 0
INFO  [init] found model autostart file as SYS_AUTOSTART=4001
INFO  [param] selected parameter default file parameters.bson
INFO  [param] selected parameter backup file parameters_backup.bson
  SYS_AUTOCONFIG: curr: 0 -> new: 1
  SYS_AUTOSTART: curr: 0 -> new: 4001
  CAL_ACC0_ID: curr: 0 -> new: 1310988
  CAL_GYRO0_ID: curr: 0 -> new: 1310988
  CAL_ACC1_ID: curr: 0 -> new: 1310996
  CAL_GYRO1_ID: curr: 0 -> new: 1310996
  CAL_ACC2_ID: curr: 0 -> new: 1311004
  CAL_GYRO2_ID: curr: 0 -> new: 1311004
  CAL_MAG0_ID: curr: 0 -> new: 197388
  CAL_MAG0_PRIO: curr: -1 -> new: 50
  CAL_MAG1_ID: curr: 0 -> new: 197644
  CAL_MAG1_PRIO: curr: -1 -> new: 50
  SENS_BOARD_X_OFF: curr: 0.0000 -> new: 0.0000
  SENS_DPRES_OFF: curr: 0.0000 -> new: 0.0010
INFO  [dataman] data manager file './dataman' size is 7866664 bytes
INFO  [init] starting gazebo with world: /home/luky/px4-SITL/PX4-Autopilot/Tools/simulation/gz/worlds/default.sdf
WARN  [init] PX4_GZ_MODEL_NAME or PX4_GZ_MODEL not set using PX4_SIM_MODEL.
INFO  [gz_bridge] world: default, model name: x500_0, simulation model: x500
ERROR [gz_bridge] timed out waiting for clock message
ERROR [gz_bridge] Task start failed (-1)
ERROR [init] gz_bridge failed to start
ERROR [px4] Startup script returned with return value: 256

I tried making clean build of px4 and I also tried deleting the whole git clone and creating new one + of course running ubuntu.sh script.
Does anyone has idea, what is going on?

thank you!

same here! I’m currently checking my installation my I cannot get it to work yet

Hi, yesterday had this issue and I think it was a ghost process of Gazebo that didn’t closed properly… I tried pkill -9 ruby and it worked again.
Gazebo must be running for the gz_bridge to connect, so you could also make sure that the clock of gazebo is running by looking at the Gazebo UI, bottom right.
One last though would be to check that GZ_IP and GZ_PARTITION env. variables are not set (you can unset GZ_IP for example).

1 Like