Skip to content

Commit

Permalink
update Jazzy release note.
Browse files Browse the repository at this point in the history
Signed-off-by: Tomoya Fujita <[email protected]>
  • Loading branch information
fujitatomoya committed Feb 9, 2024
1 parent c569b50 commit fbe8d8b
Showing 1 changed file with 10 additions and 1 deletion.
11 changes: 10 additions & 1 deletion source/Releases/Release-Jazzy-Jalisco.rst
Original file line number Diff line number Diff line change
Expand Up @@ -51,7 +51,6 @@ In Humble, the headers: ``tf2_bullet/tf2_bullet.h``, ``tf2_eigen/tf2_eigen.h``,
In Jazzy, the ``tf2_bullet/tf2_bullet.h``, ``tf2_eigen/tf2_eigen.h``, ``tf2_geometry_msgs/tf2_geometry_msgs.h``,
``tf2_kdl/tf2_kdl.h``, ``tf2_sensor_msgs/tf2_sensor_msgs.h`` headers have been completely removed.


``rclcpp``
^^^^^^^^^^

Expand All @@ -76,6 +75,16 @@ New type support helper for services ``rclcpp::get_service_typesupport_handle``

See https://github.com/ros2/rclcpp/pull/2209 for more details.

``rclpy``
^^^^^^^^^^

``rclpy.node.Node.declare_parameter``
"""""""""""""""""""""""""""""""""""""

The ``rclpy.node.Node.declare_parameter`` does not allow statically typing parameter without default value.

See https://github.com/ros2/rclpy/pull/1216 for more details.

``ros2cli``
^^^^^^^^^^^

Expand Down

0 comments on commit fbe8d8b

Please sign in to comment.