Gazebo entities not rendered

Anyone ever have a problem like this before?

I’m running make px4_sitl gz_x500_baylands and it seems like everything is working other than the drone and the park are not actually rendered.

I’ve tried both the v1.15.4 tag and the current main branch and both have the same result.

Running on a brand new Ubuntu 22.04 install in VMWare Workstation.

The baylands world can take a while to load. Does it work with the default world? Can you share the output from the startup?

The default world is similar. The drone doesn’t render.

Nothing jumps out at me in the console output.

$ make px4_sitl gz_x500_baylands
[0/1] cd /home/david/work/px4-autopilot/build/px4_sitl...avid/work/px4-autopilot/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] importing from 'parameters.bson'
INFO  [parameters] BSON document size 423 bytes, decoded 423 bytes (INT32:15, FLOAT:6)
INFO  [param] selected parameter backup file parameters_backup.bson
INFO  [dataman] data manager file './dataman' size is 1208528 bytes
INFO  [init] Gazebo simulator
INFO  [init] Starting gazebo with world: /home/david/work/px4-autopilot/Tools/simulation/gz/worlds/baylands.sdf
INFO  [init] Starting gz gui
Warning [Utils.cc:132] [/pose/relative_to:/home/david/work/px4-autopilot/Tools/simulation/gz/worlds/baylands.sdf:L45]: XML Element[relative_to], child of element[pose], not defined in SDF. Copying[relative_to] as children of [pose].
INFO  [init] Waiting for Gazebo world...
INFO  [init] Waiting for Gazebo world...
INFO  [init] Waiting for Gazebo world...
INFO  [init] Gazebo world is ready
INFO  [init] Spawning model
INFO  [gz_bridge] world: baylands, model: x500_0
INFO  [lockstep_scheduler] setting initial absolute time to 2584000 us
INFO  [commander] LED: open /dev/led0 failed (22)
WARN  [health_and_arming_checks] Preflight Fail: ekf2 missing data
WARN  [health_and_arming_checks] Preflight Fail: No connection to the ground control station	
INFO  [tone_alarm] home set
INFO  [uxrce_dds_client] init UDP agent IP:127.0.0.1, port:8888
INFO  [mavlink] mode: Normal, data rate: 4000000 B/s on udp port 18570 remote port 14550
INFO  [mavlink] mode: Onboard, data rate: 4000000 B/s on udp port 14580 remote port 14540
INFO  [mavlink] mode: Onboard, data rate: 4000 B/s on udp port 14280 remote port 14030
INFO  [mavlink] mode: Gimbal, data rate: 400000 B/s on udp port 13030 remote port 13280
INFO  [mavlink] partner IP: 127.0.0.1
INFO  [logger] logger started (mode=all)
INFO  [logger] Start file log (type: full)
INFO  [logger] [logger] ./log/2025-03-31/01_13_03.ulg	
INFO  [logger] Opened full log file: ./log/2025-03-31/01_13_03.ulg
INFO  [mavlink] MAVLink only on localhost (set param MAV_{i}_BROADCAST = 1 to enable network)
INFO  [mavlink] MAVLink only on localhost (set param MAV_{i}_BROADCAST = 1 to enable network)
INFO  [px4] Startup script returned successfully
pxh> INFO  [tone_alarm] notify positive
INFO  [commander] Ready for takeoff!

I can still fly the drone and crash into trees and stuff, so I’m pretty sure that the files actually loaded correctly. I just can’t see anything.

Can you enable gz debugging?

export GZ_VERBOSE=4

I think running in a VM isn’t well tested

Had to use a pastebin for the verbose output because it exceeds the 32k character limit of this forum.

The “No camera …” keeps repeating forever at the end.

Hmmm nothing obvious jumps out at me. It does look like the sim starts successfully.