Skip to content

Commit d331434

Browse files
Added some kilted release notes (#5319) (#5339)
Signed-off-by: Alejandro Hernandez Cordero <[email protected]> Signed-off-by: Alejandro Hernández Cordero <[email protected]> (cherry picked from commit 3b112a8) Co-authored-by: Alejandro Hernández Cordero <[email protected]>
1 parent 115ad41 commit d331434

File tree

1 file changed

+161
-0
lines changed

1 file changed

+161
-0
lines changed

source/Releases/Release-Kilted-Kaiju.rst

Lines changed: 161 additions & 0 deletions
Original file line numberDiff line numberDiff line change
@@ -41,9 +41,151 @@ TODO
4141
New features in this ROS 2 release
4242
----------------------------------
4343

44+
``ament_cmake_ros``
45+
^^^^^^^^^^^^^^^^^^^
46+
47+
Add rmw_test_fixture for supporting RMW-isolated testing
48+
""""""""""""""""""""""""""""""""""""""""""""""""""""""""
49+
50+
Included two new packages which provide an extensible mechanism for creating a test fixture for RMW-based communication isolation.
51+
It is modeled closely after the rmw and rmw_implementation API.
52+
53+
The ``rmw_test_fixture`` package currently provides only the API, which could be implemented by an RMW provider for configuring their RMW for a test to run.
54+
55+
The ``rmw_test_fixture_implementation`` package provides the entry point for discovering, loading, and invoking the appropriate extension.
56+
57+
See https://github.com/ros2/ament_cmake_ros/pull/21 for more details.
58+
59+
``common_interfaces``
60+
^^^^^^^^^^^^^^^^^^^^^
61+
62+
New PoseStampedArray message
63+
""""""""""""""""""""""""""""
64+
65+
Added a pose stamped array message to nav_msgs.
66+
67+
See https://github.com/ros2/common_interfaces/pull/240 for more details.
68+
69+
``ros2cli``
70+
^^^^^^^^^^^
71+
72+
Action introspection
73+
""""""""""""""""""""
74+
75+
This allows to instrospect an action with the command line.
76+
Using ``ros2cli`` tools: ``ros2 action echo <action name>``.
77+
78+
See https://github.com/ros2/ros2cli/pull/978 for more information.
79+
80+
``rclcpp``
81+
^^^^^^^^^^
82+
83+
Action generic client
84+
"""""""""""""""""""""
85+
86+
Support action generic client, this is used to support actions in rosbag2.
87+
88+
See https://github.com/ros2/rclcpp/pull/2759 for more details.
89+
90+
``rosbag2``
91+
^^^^^^^^^^^
92+
93+
Action introspection rosbag2 support
94+
""""""""""""""""""""""""""""""""""""
95+
96+
Allow to record and play actions from a rosbag.
97+
98+
See https://github.com/ros2/rosbag2/pull/1955 for more information.
99+
Design document https://github.com/ros2/rosbag2/pull/1928.
100+
101+
``rosidl_rust``
102+
^^^^^^^^^^^^^^^
103+
104+
Added ``rosidl_rust``
105+
"""""""""""""""""""""
106+
107+
A Rust idl generator was added to the list of default code generators.
108+
109+
See https://github.com/ros2/ros2/pull/1674 for more details.
110+
111+
``ros2``
112+
^^^^^^^^
113+
114+
Switch to using Pixi/Conda for Windows
115+
""""""""""""""""""""""""""""""""""""""
116+
117+
This allows to easily manage dependencies, and to update them in the future.
118+
The installation process is significantly simplified.
119+
Instead of dozens of steps to install dependencies, it is just a couple of commands.
120+
It is much easier to update dependencies.
121+
The dependencies are installed in individual workspaces, with no “global” installation.
122+
123+
See https://github.com/ros2/ci/pull/802 and https://github.com/ros2/ros2/pull/1642 for more details.
124+
Visit :doc:`Windows source install instructions <../Installation/Alternatives/Windows-Development-Setup>` to install it on Windows.
125+
126+
Support topic instances in DDS topics
127+
"""""""""""""""""""""""""""""""""""""
128+
129+
Topic instances are a way of multiplexing the transmission of updates of several objects of the same logical kind over the same resource, i.e. the topic.
130+
131+
See https://github.com/ros2/ros2/issues/1538 for more information.
132+
You can also check the documentation: https://github.com/ros2/design/pull/340/files.
133+
44134
Changes since the Jazzy release
45135
-------------------------------
46136

137+
``common_interfaces``
138+
^^^^^^^^^^^^^^^^^^^^^
139+
140+
Added NV12 to pixel formats
141+
"""""""""""""""""""""""""""
142+
143+
Added NV12 to pixel formats, which is a common output format of hardware-accelerated decoders
144+
145+
See https://github.com/ros2/common_interfaces/pull/253 for more details.
146+
147+
``rmw_connextdds_cpp``
148+
^^^^^^^^^^^^^^^^^^^^^^
149+
150+
Version bumped to 7.3
151+
"""""""""""""""""""""
152+
153+
The RTI Connext DDS version was bumped to 7.3.0.
154+
155+
See https://github.com/ros2/ci/pull/811 for more details.
156+
157+
``Connextmicro``
158+
^^^^^^^^^^^^^^^^
159+
160+
deprecated Connextmicro
161+
"""""""""""""""""""""""
162+
163+
The RTI Connext Micro RMW package, ``rmw_connextddsmicro``, is going to stop receiving updates in Kilted Kaiju, and be removed in a future ROS 2 release.
164+
165+
See https://github.com/ros2/rmw_connextdds/pull/182 for more information.
166+
167+
``rosidl_dynamic_typesupport``
168+
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^
169+
170+
Removing support for float128
171+
"""""""""""""""""""""""""""""
172+
173+
Removed support for float128 because there are inconsistencies in the definition.
174+
175+
See https://github.com/ros2/rosidl_dynamic_typesupport/issues/11 for more details.
176+
177+
``rmw_fastrtps_cpp``
178+
^^^^^^^^^^^^^^^^^^^^
179+
180+
Renaming package from fastrtps to fastdds
181+
"""""""""""""""""""""""""""""""""""""""""
182+
183+
``fastrtps`` was renamed to ``fastdds``.
184+
The names of the rmw implementations stay the same.
185+
XML Profile ENV strings will change.
186+
187+
See https://github.com/ros2/ros2/pull/1641 for more details.
188+
47189
ament_target_dependencies is deprecated
48190
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^
49191

@@ -85,6 +227,25 @@ If the ``model`` launch configuration was set to ``my_model``, this would result
85227
86228
For more information, see `ros2/launch#835 <https://github.com/ros2/launch/issues/835>`__ and `ros2/launch#838 <https://github.com/ros2/launch/pull/838>`__.
87229

230+
``rmw_zenoh_cpp``
231+
^^^^^^^^^^^^^^^^^
232+
233+
``Tier 1``
234+
""""""""""
235+
236+
The ``rmw_zenoh_cpp`` is now considered Tier 1.
237+
There are many PRs (summarized in `ros2/rmw_zenoh#265 <https://github.com/ros2/rmw_zenoh/issues/265>`__) in the ROS 2 core packages, such as:
238+
239+
* Make the rmw pass all core tests.
240+
* Implement and document security
241+
* Make it work in the Tier 1 platforms.
242+
* Added Quality declarations
243+
* Added to REP 2005
244+
* A dedicated nightly CI job
245+
* Among others
246+
247+
For more information see https://github.com/ros2/rmw_zenoh/issues/265.
248+
88249
Development progress
89250
--------------------
90251

0 commit comments

Comments
 (0)