Skip to content

Commit

Permalink
update Jazzy release note. (#4160) (#4166)
Browse files Browse the repository at this point in the history
* update Jazzy release note.

Signed-off-by: Tomoya Fujita <Tomoya.Fujita@sony.com>
(cherry picked from commit 988e748)

Co-authored-by: Tomoya Fujita <Tomoya.Fujita@sony.com>
  • Loading branch information
mergify[bot] and fujitatomoya authored Feb 13, 2024
1 parent de93b3c commit bdb8161
Showing 1 changed file with 33 additions and 18 deletions.
51 changes: 33 additions & 18 deletions source/Releases/Release-Jazzy-Jalisco.rst
Original file line number Diff line number Diff line change
Expand Up @@ -39,6 +39,33 @@ TODO
New features in this ROS 2 release
----------------------------------

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

Type support helper for services
""""""""""""""""""""""""""""""""

New type support helper for services ``rclcpp::get_service_typesupport_handle`` is added to extract service type support handle.

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

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

``--log-file-name`` command line argument
"""""""""""""""""""""""""""""""""""""""""

It is now possible to use ``--log-file-name`` command line argument to specify the log file name prefix.

.. code-block:: bash
ros2 run demo_nodes_cpp talker --ros-args --log-file-name filename
See https://github.com/ros2/ros2cli/issues/856 for more information.

Changes since the Iron release
------------------------------

``geometry2``
^^^^^^^^^^^^^

Expand All @@ -51,7 +78,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 @@ -69,26 +95,15 @@ Deprecated ``rclcpp/qos_event.hpp`` header was removed
In Iron, the header ``rclcpp/qos_event.hpp`` was deprecated in favor of ``rclcpp/event_handler.hpp``.
In Jazzy, the ``rclcpp/qos_event.hpp`` header been completely removed.

Type support helper for services
""""""""""""""""""""""""""""""""

New type support helper for services ``rclcpp::get_service_typesupport_handle`` is added to extract service type support handle.

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

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

``--log-file-name`` command line argument
"""""""""""""""""""""""""""""""""""""""""

It is now possible to use ``--log-file-name`` command line argument to specify the log file name prefix.
``rclpy``
^^^^^^^^^^

.. code-block:: bash
``rclpy.node.Node.declare_parameter``
"""""""""""""""""""""""""""""""""""""

ros2 run demo_nodes_cpp talker --ros-args --log-file-name filename
The ``rclpy.node.Node.declare_parameter`` does not allow statically typing parameter without default value.

See https://github.com/ros2/ros2cli/issues/856 for more information.
See https://github.com/ros2/rclpy/pull/1216 for more details.


Development progress
Expand Down

0 comments on commit bdb8161

Please sign in to comment.