diff --git a/source/Releases/Release-Jazzy-Jalisco.rst b/source/Releases/Release-Jazzy-Jalisco.rst index b9e16009a3e..491ea1ce9aa 100644 --- a/source/Releases/Release-Jazzy-Jalisco.rst +++ b/source/Releases/Release-Jazzy-Jalisco.rst @@ -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`` ^^^^^^^^^^^^^ @@ -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`` ^^^^^^^^^^ @@ -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