Skip to content

Commit 196be94

Browse files
authored
Merge pull request #1 from pedro-fuoco/ros2-interface-additions
Ros2 interface additions - extra suggestions
2 parents 49652c9 + 809081d commit 196be94

File tree

1 file changed

+12
-1
lines changed

1 file changed

+12
-1
lines changed

dev/source/docs/ros2-interfaces.rst

+12-1
Original file line numberDiff line numberDiff line change
@@ -70,6 +70,11 @@ Pose, Rates, and Coordinates
7070
<td>This is the filtered AHRS's velocity in the local ENU frame relative to home.</td>
7171
</tr>
7272
<tr>
73+
<td>ap/pose/filtered</td>
74+
<td>geometry_msgs/msg/PoseStamped</td>
75+
<td>This is the filtered AHRS's pose in the local ENU frame relative to home.</td>
76+
</tr>
77+
<tr>
7378
<td>ap/geopose/filtered</td>
7479
<td>geographic_msgs/msg/GeoPoseStamped</td>
7580
<td>This is the filtered AHRS's pose (position+orientation) in global coordinates</td>
@@ -191,6 +196,12 @@ For more information on the coordinate systems used, review `ROS REP-105 <https:
191196
</tbody>
192197
</table>
193198

199+
.. warning::
200+
Only the dynamic transformations on ``/ap/tf`` that have parent_frame ``odom`` and child_frame ``base_link`` are fed into ``AP_VisualOdom``.
201+
Other frame configurations will be gracefully ignored, so feel free to populate this topic with other transforms if that's convenient.
202+
203+
For more information on how to setup ArduPilot with an external odometry source,
204+
see the :ref:`cartographer SLAM example<ros2-cartographer-slam>.
194205

195206
Configuring Interfaces at Compile Time
196207
======================================
@@ -244,6 +255,6 @@ If breaking changes are required, the ArduPilot release notes will make that cle
244255
Developers should not expect ABI stability on ``exerimental`` interfaces.
245256

246257
Because ArduPilot does not follow the same release timeline as ROS 2, and
247-
the development team for the ROS interface still in its early stages,
258+
the development team for the ROS interface is still in its early stages,
248259
ArduPilot does not yet support a stable ABI across multiple ROS distributions.
249260
The current ROS version supported is ``humble``.

0 commit comments

Comments
 (0)