I've called my own model into Gazebo via the command 'make px4_sitl gazebo-classic_r1_rover' but it doesn't connect to QGC.

r1_rover is an existing model, and after I deleted the sdf.jinja file and the mesh file, I inserted my code and called it. It is created through a make command on Gazebo, but it does not work with QGC.

apollo@apollo:~/PX4-Autopilot$ make px4_sitl gazebo-classic_r1_rover
[0/4] Performing build step for ‘sitl_gazebo-classic’
ninja: no work to do.
[3/4] cd /home/apollo/PX4-Autopilot/bu…o/PX4-Autopilot/build/px4_sitl_default
SITL ARGS
sitl_bin: /home/apollo/PX4-Autopilot/build/px4_sitl_default/bin/px4
debugger: none
model: r1_rover
world: none
src_path: /home/apollo/PX4-Autopilot
build_path: /home/apollo/PX4-Autopilot/build/px4_sitl_default
GAZEBO_PLUGIN_PATH :/home/apollo/PX4-Autopilot/build/px4_sitl_default/build_gazebo-classic
GAZEBO_MODEL_PATH :/home/apollo/PX4-Autopilot/Tools/simulation/gazebo-classic/sitl_gazebo-classic/models
LD_LIBRARY_PATH :/home/apollo/PX4-Autopilot/build/px4_sitl_default/build_gazebo-classic
empty world, setting empty.world as default
Using: /home/apollo/PX4-Autopilot/Tools/simulation/gazebo-classic/sitl_gazebo-classic/models/r1_rover/r1_rover.sdf
SITL COMMAND: “/home/apollo/PX4-Autopilot/build/px4_sitl_default/bin/px4” “/home/apollo/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=1061
INFO [param] selected parameter default file parameters.bson
INFO [param] importing from ‘parameters.bson’
INFO [parameters] BSON document size 408 bytes, decoded 408 bytes (INT32:14, FLOAT:6)
INFO [param] selected parameter backup file parameters_backup.bson
SYS_AUTOCONFIG: curr: 0 → new: 1

  • SYS_AUTOSTART: curr: 10017 → new: 1061
  • 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.12.0
    Copyright (C) 2012 Open Source Robotics Foundation.
    Released under the Apache 2 License.
    http://gazebosim.org

[Msg] Waiting for master.
[Msg] Connected to gazebo master @ http://127.0.0.1:11345
[Msg] Publicized address: 192.168.0.68
INFO [dataman] data manager file ‘./dataman’ size is 7866640 bytes
etc/init.d-posix/rcS: 39: [: Illegal number:
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.

This looks suspicious. Have a look there.