|
39 | 39 | New features in this ROS 2 release |
40 | 40 | ---------------------------------- |
41 | 41 |
|
| 42 | +``geometry2`` |
| 43 | +^^^^^^^^^^^^^ |
| 44 | + |
| 45 | +Deprecated headers were removed |
| 46 | +""""""""""""""""""""""""""""""" |
| 47 | + |
| 48 | +In Humble, the headers: ``tf2_bullet/tf2_bullet.h``, ``tf2_eigen/tf2_eigen.h``, ``tf2_geometry_msgs/tf2_geometry_msgs.h``, |
| 49 | +``tf2_kdl/tf2_kdl.h``, ``tf2_sensor_msgs/tf2_sensor_msgs.h`` were deprecated in favor of: ``tf2_bullet/tf2_bullet.hpp``, |
| 50 | +``tf2_eigen/tf2_eigen.hpp``, ``tf2_geometry_msgs/tf2_geometry_msgs.hpp``, ``tf2_kdl/tf2_kdl.hpp``, ``tf2_sensor_msgs/tf2_sensor_msgs.hpp`` |
| 51 | +In Jazzy, the ``tf2_bullet/tf2_bullet.h``, ``tf2_eigen/tf2_eigen.h``, ``tf2_geometry_msgs/tf2_geometry_msgs.h``, |
| 52 | +``tf2_kdl/tf2_kdl.h``, ``tf2_sensor_msgs/tf2_sensor_msgs.h`` headers have been completely removed. |
| 53 | + |
| 54 | + |
| 55 | +``rclcpp`` |
| 56 | +^^^^^^^^^^ |
| 57 | + |
| 58 | +``rclcpp::get_typesupport_handle`` is deprecated |
| 59 | +"""""""""""""""""""""""""""""""""""""""""""""""" |
| 60 | + |
| 61 | +The ``rclcpp::get_typesupport_handle`` that extracts message type support handle is deprecated, and will be removed in a future release. |
| 62 | +Instead, ``rclcpp::get_message_typesupport_handle`` should be used. |
| 63 | + |
| 64 | +See https://github.com/ros2/rclcpp/pull/2209 for more details. |
| 65 | + |
| 66 | +Type support helper for services |
| 67 | +"""""""""""""""""""""""""""""""" |
| 68 | + |
| 69 | +New type support helper for services ``rclcpp::get_service_typesupport_handle`` is added to extract service type support handle. |
| 70 | + |
| 71 | +See https://github.com/ros2/rclcpp/pull/2209 for more details. |
| 72 | + |
| 73 | +``ros2cli`` |
| 74 | +^^^^^^^^^^^ |
| 75 | + |
| 76 | +``--log-file-name`` command line argument |
| 77 | +""""""""""""""""""""""""""""""""""""""""" |
| 78 | + |
| 79 | +It is now possible to use ``--log-file-name`` command line argument to specify the log file name prefix. |
| 80 | + |
| 81 | +.. code-block:: bash |
| 82 | +
|
| 83 | + ros2 run demo_nodes_cpp talker --ros-args --log-file-name filename |
| 84 | +
|
| 85 | +See https://github.com/ros2/ros2cli/issues/856 for more information. |
| 86 | + |
| 87 | + |
42 | 88 | Development progress |
43 | 89 | -------------------- |
44 | 90 |
|
@@ -94,38 +140,3 @@ Release Timeline |
94 | 140 |
|
95 | 141 | .. [1] The ``ros_base`` variant is described in `REP 2001 (ros-base) <https://www.ros.org/reps/rep-2001.html#ros-base>`_. |
96 | 142 | .. [2] The ``desktop`` variant is described in `REP 2001 (desktop-variants) <https://www.ros.org/reps/rep-2001.html#desktop-variants>`_. |
97 | | -
|
98 | | -New features in this ROS 2 release |
99 | | ----------------------------------- |
100 | | - |
101 | | -``rclcpp`` |
102 | | -^^^^^^^^^^ |
103 | | - |
104 | | -``rclcpp::get_typesupport_handle`` is deprecated |
105 | | -"""""""""""""""""""""""""""""""""""""""""""""""" |
106 | | - |
107 | | -The ``rclcpp::get_typesupport_handle`` that extracts message type support handle is deprecated, and will be removed in a future release. |
108 | | -Instead, ``rclcpp::get_message_typesupport_handle`` should be used. |
109 | | - |
110 | | -See https://github.com/ros2/rclcpp/pull/2209 for more details. |
111 | | - |
112 | | -Type support helper for services |
113 | | -"""""""""""""""""""""""""""""""" |
114 | | - |
115 | | -New type support helper for services ``rclcpp::get_service_typesupport_handle`` is added to extract service type support handle. |
116 | | - |
117 | | -See https://github.com/ros2/rclcpp/pull/2209 for more details. |
118 | | - |
119 | | -``ros2cli`` |
120 | | -^^^^^^^^^^^ |
121 | | - |
122 | | -``--log-file-name`` command line argument |
123 | | -""""""""""""""""""""""""""""""""""""""""" |
124 | | - |
125 | | -It is now possible to use ``--log-file-name`` command line argument to specify the log file name prefix. |
126 | | - |
127 | | -.. code-block:: bash |
128 | | -
|
129 | | - ros2 run demo_nodes_cpp talker --ros-args --log-file-name filename |
130 | | -
|
131 | | -See https://github.com/ros2/ros2cli/issues/856 for more information. |
|
0 commit comments