Gazebo Classic takeoff issues and errors

Hi folks, I am using WSL 2 “Ubuntu 20.04”, successfully cloned PX4 autopilot by following instruction. I’m trying to run the gazebo classic simulation, but its not making any progress, can be seen in the following

Errors summary:

Warning [parser.cc:833] XML Attribute[version] in element[sdf] not defined in SDF, ignoring.

[Err] [RenderEngine.cc:749] Can’t open display:
[Wrn] [RenderEngine.cc:292] Cannot initialize render engine since render path type is NONE. Ignore this warning if rendering has been turned off on purpose.
[Wrn] [GuiIface.cc:114] could not connect to display
[Msg] Could not load the Qt platform plugin “xcb” in “” even though it was found.
[Err] [GuiIface.cc:118] This application failed to start because no Qt platform plugin could be initialized. Reinstalling the application may fix this problem.

Available platform plugins are: eglfs, linuxfb, minimal, minimalegl, offscreen, vnc, xcb.

WARN [health_and_arming_checks] Preflight Fail: ekf2 missing data

Detailed response

iftikhar@DESKTOP-GH9UI2B:~/PX4-Autopilot$ make px4_sitl gazebo-classic
[0/4] Performing build step for ‘sitl_gazebo-classic’
ninja: no work to do.
[3/4] cd /home/iftikhar/PX4-Autopilot/build/px4_sitl_defau…opilot /home/iftikhar/PX4-Autopilot/build/px4_sitl_default
SITL ARGS
sitl_bin: /home/iftikhar/PX4-Autopilot/build/px4_sitl_default/bin/px4
debugger: none
model: iris
world: none
src_path: /home/iftikhar/PX4-Autopilot
build_path: /home/iftikhar/PX4-Autopilot/build/px4_sitl_default
GAZEBO_PLUGIN_PATH :/home/iftikhar/PX4-Autopilot/build/px4_sitl_default/build_gazebo-classic
GAZEBO_MODEL_PATH :/home/iftikhar/PX4-Autopilot/Tools/simulation/gazebo-classic/sitl_gazebo-classic/models
LD_LIBRARY_PATH :/home/iftikhar/PX4-Autopilot/build/px4_sitl_default/build_gazebo-classic
empty world, setting empty.world as default
Using: /home/iftikhar/PX4-Autopilot/Tools/simulation/gazebo-classic/sitl_gazebo-classic/models/iris/iris.sdf
Warning [parser.cc:833] XML Attribute[version] in element[sdf] not defined in SDF, ignoring.
SITL COMMAND: “/home/iftikhar/PX4-Autopilot/build/px4_sitl_default/bin/px4” “/home/iftikhar/PX4-Autopilot/build/px4_sitl_default”/etc


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

px4 starting.

INFO [px4] startup script: /bin/sh etc/init.d-posix/rcS 0
INFO [init] found model autostart file as SYS_AUTOSTART=10015
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: 10015
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
Gazebo multi-robot simulator, version 11.14.0
Copyright (C) 2012 Open Source Robotics Foundation.
Released under the Apache 2 License.

[Msg] Waiting for master.
[Msg] Connected to gazebo master @ http://127.0.0.1:11345
[Msg] Publicized address: 172.28.34.171
[Err] [RenderEngine.cc:749] Can’t open display:
[Wrn] [RenderEngine.cc:89] Unable to create X window. Rendering will be disabled
[Wrn] [RenderEngine.cc:292] Cannot initialize render engine since render path type is NONE. Ignore this warning if rendering has been turned off on purpose.
[Wrn] [GuiIface.cc:114] could not connect to display
[Msg] Could not load the Qt platform plugin “xcb” in “” even though it was found.
[Err] [GuiIface.cc:118] This application failed to start because no Qt platform plugin could be initialized. Reinstalling the application may fix this problem.

Available platform plugins are: eglfs, linuxfb, minimal, minimalegl, offscreen, vnc, xcb.

INFO [dataman] data manager file ‘./dataman’ size is 7872608 bytes
INFO [init] PX4_SIM_HOSTNAME: localhost
INFO [simulator_mavlink] Waiting for simulator to accept connection on TCP port 4560
INFO [simulator_mavlink] Simulator connected on TCP port 4560.
INFO [lockstep_scheduler] setting initial absolute time to 3884000 us
INFO [commander] LED: open /dev/led0 failed (22)
WARN [health_and_arming_checks] Preflight Fail: ekf2 missing data
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 [tone_alarm] home set
INFO [logger] logger started (mode=all)
INFO [logger] Start file log (type: full)
INFO [logger] [logger] .//log/2024-07-29/11_37_42.ulg
INFO [mavlink] MAVLink only on localhost (set param MAV_{i}BROADCAST = 1 to enable network)
INFO [logger] Opened full log file: .//log/2024-07-29/11_37_42.ulg
INFO [mavlink] MAVLink only on localhost (set param MAV
{i}_BROADCAST = 1 to enable network)
INFO [px4] Startup script returned successfully
pxh> INFO [commander] Ready for takeoff!

pxh> commander takeoff
pxh> INFO [commander] Armed by internal command
INFO [navigator] Using default takeoff altitude: 2.5 m
INFO [tone_alarm] arming warning
INFO [commander] Takeoff detected

[Showing no progress after the final script]
Can you please suggest the solutions.