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

ROS: modify iris example to support sdformat_urdf #56

Closed srmainwaring closed 1 year ago

srmainwaring commented 1 year ago

Modifications to support running ArduPilot SITL / Gazebo with ROS 2.

The ros2 branch includes changes to make the iris model compatible with the package sdformat_urdf. The package allows a SDFormat robot model to be used as a robot description by ROS tools such as RViz, however it imposes some restrictions on the model.

Details

Changes to model structure

Transform fix

Rendering

Additional sensors

Future work: merging changes back into main