ArduPilot / ardupilot_gazebo

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

Add support for nested models #8

Closed srmainwaring closed 1 year ago

srmainwaring commented 2 years ago

Bug Fix

Fixes #6

Details

Fix the issue that the methods to find links, joints and sensors were not searching in nested models. This will permit more complex models containing sensors and other peripherals to be composed from a collection of simpler models.

ArduPilot plugin

Models

Testing

Tested on a VMware Fusion 12 Ubuntu 20.04 VM with the most recent version of ignition edifice:

$ ign gazebo --version
Ignition Gazebo, version 5.3.0
Copyright (C) 2018 Open Source Robotics Foundation.
Released under the Apache 2.0 License.

An example of a model composed from a nested model is available here: https://github.com/srmainwaring/SITL_Models/tree/ignition/wildthumper-nested

srmainwaring commented 1 year ago

Closed. Will open new PR forward ported to gazebo garden.