Background
Hello, I am relatively new to the PX4 environment and simulation tools on Gazebo. I am trying to simulate a custom airship.
My goal is to duplicate the already available âcloudshipâ folder and tweak the model values in the .sdf and airframe file and replace the .stl 3D model in order to control it in Gazebo using QGroundControl
Procedure
I followed these steps, found on other discussion threads:
- Created a folder under Tools/sitl_gazebo/models called âmy_vehicleâ.
- Created the following files: my_vehicle.sdf and model.config (from âcloudshipâ).
- Added the âcloudshipâ .stl files to the folder.
- Created an airframe file under ROMFS/px4fmu_common/init.d-posix (from âcloudshipâ).
- Added the new airframe name to the cmakelist file in this folder.
I saw that another required step was to add the airframe/folder name to the platforms/posix/cmake/sitl_target.cmake file but could not locate it in the PX4 directory.
Issues
After rebuilding the environment by entering the âmake px4_sitl_default gazeboâ command I try to run the new folder âmy_vehicleâ by entering âmake px4_sitl gazebo_my_vehicleâ or âmake px4_sitl gazebo-classic_my_vehicleâ.
I get the following error : 'unknown target âgazebo_my_vehicleâ and the âmy_vehicleâ folder I just created is gone.
Any help would be greatly appreciated,
Thank you,
Luca