PX4 ROS Gazebo simulation - GPS issue, takeoff refected

I’ve used an sdf supplied from the Gazebo SITL.
Though, to add more sensors I’ve converted the plane.sdf into plane.urdf and that’s where the problem began.
The GPS sensor seems to load (I’ve printed additional logs from the GPS gazebo plugin), but the /mavros/global_position/global is empty. So I assume somehow my model is wrong, though I can’t spot the issue, maybe some tag issue or some config of the pixhawk, mavlink?
Link to the urdf <?xml version="1.0" ?><robot name="plane"> <link name="base_link"> < - Pastebin.com
Pixhawk log:

[ INFO] [1661854818.246919806]: waitForService: Service [/gazebo/set_physics_properties] is now available.
[ INFO] [1661854818.265812008, 0.004000000]: Physics dynamic reconfigure ready.
[Wrn] [gazebo_gps_plugin.cpp:70] [gazebo_gps_plugin]: plane::plane using gps topic "plane"
[Wrn] [gazebo_gps_plugin.cpp:223] [gazebo_gps_plugin] Using default position noise density in Z: ~/plane/link/gps
[Msg] Connecting to PX4 SITL using TCP
[Msg] Lockstep is enabled
[Msg] Speed factor set to: 1
[Wrn] [gazebo_mavlink_interface.cpp:90] No identifier on joint. Using 0 as default sensor ID
[Msg] Using MAVLink protocol v2.0
INFO  [simulator] Simulator connected on TCP port 4560.
INFO  [commander] LED: open /dev/led0 failed (22)
INFO  [commander] Mission #2 loaded, 15 WPs, curr: 13
INFO  [init] Mixer: etc/mixers-sitl/plane_sitl.main.mix on /dev/pwm_output0
INFO  [mavlink] mode: Normal, data rate: 4000000 B/s on udp port 18570 remote port 14550
[Wrn] [Event.cc:61] Warning: Deleting a connection right after creation. Make sure to save the ConnectionPtr from a Connect call
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  [logger] logger started (mode=all)
INFO  [mavlink] MAVLink only on localhost (set param MAV_BROADCAST = 1 to enable network)
INFO  [logger] Start file log (type: full)
INFO  [logger] [logger] ./log/2022-08-30/10_20_18.ulg
INFO  [logger] Opened full log file: ./log/2022-08-30/10_20_18.ulg
INFO  [px4] Startup script returned successfully
pxh> INFO  [mavlink] partner IP: 127.0.0.1
INFO  [ecl/EKF] 392000: GPS checks passed
INFO  [ecl/EKF] 3256000: EKF aligned, (baro hgt, IMU buf: 18, OBS buf: 14)
INFO  [ecl/EKF] 3256000: reset position to last known position
INFO  [ecl/EKF] 3256000: reset velocity to zero
INFO  [ecl/EKF] 4924000: reset position to GPS
INFO  [ecl/EKF] 4924000: reset velocity to GPS
INFO  [ecl/EKF] 4924000: starting GPS fusion
WARN  [ecl/EKF] baro hgt timeout - reset to gps
WARN  [ecl/EKF] baro hgt timeout - reset to gps
WARN  [ecl/EKF] baro hgt timeout - reset to gps
WARN  [ecl/EKF] baro hgt timeout - reset to gps
WARN  [ecl/EKF] baro hgt timeout - reset to gps
WARN  [ecl/EKF] baro hgt timeout - reset to gps