Troubles adding new model for simulation in gazebo

Hi,
I just started working with the px4 software and want to add a new model named “uuv2” for simulation in gazebo.

So far I added the model to /Tools/sitl_gazebo/models and a .world file to /Tools/sitl_gazebo/world. Also, I added rc.uuv2_defaults and rc.uuv2_apps to /ROMFS/px4fmu_common/init.d, a mixer to /ROMFS/px4fmu_common/mixers and 1021_uuv2 to /ROMFS/px4fmu_common/init.d-posix.

When I then tried to launch the simulation using

make px4_sitl gazebo_uuv2

I get the following result:
error

Does anyone know how to fix this? Thanks in advance.

1 Like

You also need to put your model name in:

/Firmware/platforms/posix/cmake/sitl_target.cmake

Look for the line that starts with:

set(models ...

and add the name of your new model.

1 Like

Thank you. It is working now.