ArduPilot / ardupilot_gazebo

Plugins and models for vehicle simulation in Gazebo Sim with ArduPilot SITL controllers
GNU Lesser General Public License v3.0
81 stars 76 forks source link

Hexacopter typhoon-h480 model for Ardupilot gazebo #62

Closed rahulOCR closed 1 year ago

rahulOCR commented 1 year ago

Hexacopter h480 model taken from PX4 for Ardupilot Gazebo model.

modification to be needed in /Tools/autotest/pysim/vehicleinfo.py "gazebo-typhoon_h480": { "waf_target": "bin/arducopter", "default_params_filename": ["default_params/copter.parm", "default_params/copter-hexa.parm", "default_params/copter-hexa-cwx.parm"], "external": True,

srmainwaring commented 1 year ago

Hi @rahulOCR, thanks for the suggestion. We prefer to add new models to https://github.com/ArduPilot/SITL_Models to keep this repo focussed on the plugin code and a small set of examples to demonstrate those.

If you'd like to add the hexacopter to https://github.com/ArduPilot/SITL_Models we'd welcome a PR there, but the model should be for gz-sim7 and the updated plugins. Your example is using the older Gazebo11 version which we are not developing further.

rahulOCR commented 1 year ago

Hi @srmainwaring , thanks for the feedback will try to implement in gz-sim7 and in concern project.