Skip to content

Commit 3fc7e3f

Browse files
Adding Transform Data Note (#4256) (#4258)
Signed-off-by: CursedRock17 <[email protected]> Signed-off-by: Alejandro Hernández Cordero <[email protected]> Co-authored-by: Alejandro Hernández Cordero <[email protected]> (cherry picked from commit 421f032) Co-authored-by: Lucas Wendland <[email protected]>
1 parent 410afd9 commit 3fc7e3f

File tree

1 file changed

+5
-0
lines changed

1 file changed

+5
-0
lines changed

source/Releases/Release-Jazzy-Jalisco.rst

Lines changed: 5 additions & 0 deletions
Original file line numberDiff line numberDiff line change
@@ -78,6 +78,11 @@ In Humble, the headers: ``tf2_bullet/tf2_bullet.h``, ``tf2_eigen/tf2_eigen.h``,
7878
In Jazzy, the ``tf2_bullet/tf2_bullet.h``, ``tf2_eigen/tf2_eigen.h``, ``tf2_geometry_msgs/tf2_geometry_msgs.h``,
7979
``tf2_kdl/tf2_kdl.h``, ``tf2_sensor_msgs/tf2_sensor_msgs.h`` headers have been completely removed.
8080

81+
Return types of `wait_for_transform_async` and `wait_for_transform_full_async` changed
82+
""""""""""""""""""""""""""""""""""""""""""""""""""""""""""""""""""""""""""""""""""""""
83+
Previously ``wait_for_transform_async`` and ``wait_for_transform_full_async`` of the ``Buffer`` class returned a future containing true or false
84+
In Jazzy, the future will contain the information of the transform being waited on.
85+
8186
``rclcpp``
8287
^^^^^^^^^^
8388

0 commit comments

Comments
 (0)