@@ -70,6 +70,11 @@ Pose, Rates, and Coordinates
70
70
<td >This is the filtered AHRS's velocity in the local ENU frame relative to home.</td >
71
71
</tr >
72
72
<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 >
73
78
<td >ap/geopose/filtered</td >
74
79
<td >geographic_msgs/msg/GeoPoseStamped</td >
75
80
<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:
191
196
</tbody >
192
197
</table >
193
198
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>.
194
205
195
206
Configuring Interfaces at Compile Time
196
207
======================================
@@ -244,6 +255,6 @@ If breaking changes are required, the ArduPilot release notes will make that cle
244
255
Developers should not expect ABI stability on ``exerimental `` interfaces.
245
256
246
257
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,
248
259
ArduPilot does not yet support a stable ABI across multiple ROS distributions.
249
260
The current ROS version supported is ``humble ``.
0 commit comments