Error while running Gazebo simulation for the first time

So im trying to run a gazebo simulation for the first time, according to the documentation Gazebo Simulation | PX4 User Guide , but for all the vehicles i try, i get pretty much the same error messages (with some variations):
make px4_sitl gz_standard_vtol
[0/1] cd /home/ramb/PX4-Autopilot/build/px4_sitl_default/src/modules/simulation/gz_bridge && /usr/bin/cmake -E env PX4_SIM_MODEL=gz_standard_vtol /home/ramb/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=4004
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: 4004
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
    ERROR [param] Parameter FW_L1_PERIOD not found.
    INFO [dataman] data manager file β€˜./dataman’ size is 7866640 bytes
    INFO [init] starting gazebo with world: /home/ramb/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: standard_vtol_0, simulation model: standard_vtol
    ERROR [gz_bridge] Service call timed out
    ERROR [gz_bridge] Task start failed (-1)
    ERROR [init] gz_bridge failed to start
    ERROR [px4] Startup script returned with return value: 256
    in addition to the simulation not working, any solutions please?