Please help in running gazebo simulation GUI, i am running px4 from Virtual Machine (multipass) (ubuntu env).
i tried below methods but with no success.
Method 1 : Standalone
/PX4-Autopilot$ PX4_GZ_STANDALONE=1 make px4_sitl gz_x500
[0/1] cd /home/ubuntu/PX4-Autopilot/bu…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] importing from ‘parameters.bson’
INFO [parameters] BSON document size 495 bytes, decoded 495 bytes (INT32:19, 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 8.9.0
INFO [init] Standalone PX4 launch, waiting for Gazebo
INFO [init] Waiting for Gazebo world…
INFO [init] Waiting for Gazebo world…
INFO [init] Waiting for Gazebo world…
INFO [init] Waiting for Gazebo world…
INFO [init] Waiting for Gazebo world…
INFO [init] Waiting for Gazebo world…
and it runs out of time…
Method 2 : Usual method
ubuntu@xxxxxxxx:~/PX4-Autopilot$ make px4_sitl gz_x500
[0/1] cd /home/ubuntu/PX4-Autopilot/bu…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] importing from ‘parameters.bson’
INFO [parameters] BSON document size 495 bytes, decoded 495 bytes (INT32:19, 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 8.9.0
INFO [init] Starting gazebo with world: /home/ubuntu/PX4-Autopilot/Tools/simulation/gz/worlds/default.sdf
INFO [init] Starting gz gui
INFO [init] Waiting for Gazebo world…
INFO [init] Gazebo world is ready
INFO [init] Spawning model
INFO [gz_bridge] world: default, model: x500_0
INFO [lockstep_scheduler] setting initial absolute time to 3996000 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: system power unavailable
WARN [health_and_arming_checks] Preflight Fail: No connection to the ground control station
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 [logger] logger started (mode=all)
INFO [logger] Start file log (type: full)
INFO [logger] [logger] ./log/2025-05-24/17_02_18.ulg
INFO [logger] Opened full log file: ./log/2025-05-24/17_02_18.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] home set
INFO [tone_alarm] notify positive
WARN [health_and_arming_checks] Preflight Fail: No connection to the ground control station
WARN [health_and_arming_checks] Preflight Fail: No connection to the ground control station
pxh> mavlink start -u 14550 -r 40000 -t 192.16xxxxx
INFO [mavlink] mode: Normal, data rate: 40000 B/s on udp port 14550 remote port 14550
pxh> INFO [commander] Ready for takeoff!
here, gazebo doesnt start.