ROS: modify iris example to support sdformat_urdf #56
Add this suggestion to a batch that can be applied as a single commit.
This suggestion is invalid because no changes were made to the code.
Suggestions cannot be applied while the pull request is closed.
Suggestions cannot be applied while viewing a subset of changes.
Only one suggestion per line can be applied in a batch.
Add this suggestion to a batch that can be applied as a single commit.
Applying suggestions on deleted lines is not supported.
You must change the existing code in this line in order to create a valid suggestion.
Outdated suggestions cannot be applied.
This suggestion has been applied or marked resolved.
Suggestions cannot be applied from pending reviews.
Suggestions cannot be applied on multi-line comments.
Suggestions cannot be applied while the pull request is queued to merge.
Suggestion cannot be applied right now. Please check back later.
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
model://{model_name}
must be replaced bypackage://{package_name}/models/{model_name}
.//model/include/@merge="true"
attribute which requires elements in included models to have unique names.Transform fix
Rendering
Additional sensors
Future work: merging changes back into
main