Skip to content

Commit 8917e2b

Browse files
Use {interface(...)} for interfaces
Signed-off-by: Christophe Bedard <[email protected]>
1 parent 09a4af0 commit 8917e2b

File tree

1 file changed

+4
-4
lines changed

1 file changed

+4
-4
lines changed

source/Tutorials/Advanced/Creating-An-RMW-Implementation.rst

Lines changed: 4 additions & 4 deletions
Original file line numberDiff line numberDiff line change
@@ -178,11 +178,11 @@ Type support
178178

179179
To bridge the gap between ROS 2 :doc:`interfaces <../../Concepts/Basic/About-Interfaces>` (specifically :doc:`custom interfaces <../Beginner-Client-Libraries/Custom-ROS2-Interfaces>`) and the underlying middleware, some glue code is needed.
180180
This is referred to as :ref:`type support <Type Specific Interfaces>`.
181-
When publishing a message of type ``std_msgs/msg/String``, ``rmw_publish()`` only gets a ``void *`` to the message, which could point to a C++ instance, or a C instance, and so on.
181+
When publishing a message of type {interface(std_msgs/msg/String)}, ``rmw_publish()`` only gets a ``void *`` to the message, which could point to a C++ instance, or a C instance, and so on.
182182
The pointer will be interpreted based on the type support information provided when the publisher was created.
183183

184184
First, code is generated for each combination of interface type and user-facing language, independent of the underlying middleware.
185-
For example, for the ``std_msgs/msg/String`` message type, data structures are generated:
185+
For example, for the {interface(std_msgs/msg/String)} message type, data structures are generated:
186186

187187
#. C++: ``std_msgs/msg/string.hpp`` header with ``std_msgs::msg::String`` class generated by the ``rosidl_generator_cpp`` package
188188
#. C: ``std_msgs/msg/string.h`` header with ``std_msgs__msg__String`` struct generated by the ``rosidl_generator_c`` package
@@ -467,7 +467,7 @@ Footnotes
467467
See `ros2/rmw_cyclonedds#377 <https://github.com/ros2/rmw_cyclonedds/issues/377>`_.
468468
469469
.. [#fn_ts_fastrtps]
470-
For example, the C++ message Fast CDR serialization/deserialization code generated for ``std_msgs/msg/Header`` is at ``std_msgs/rosidl_typesupport_fastrtps_cpp/std_msgs/msg/detail/dds_fastrtps/header__type_support.cpp`` under the ``build/`` directory.
470+
For example, the C++ message Fast CDR serialization/deserialization code generated for {interface(std_msgs/msg/Header)} is at ``std_msgs/rosidl_typesupport_fastrtps_cpp/std_msgs/msg/detail/dds_fastrtps/header__type_support.cpp`` under the ``build/`` directory.
471471
472472
.. [#fn_ts_dynamic]
473-
For example, the C++ message introspection code generated for ``std_msgs/msg/Header`` is at ``std_msgs/rosidl_typesupport_introspection_cpp/std_msgs/msg/detail/header__type_support.cpp`` under the ``build/`` directory.
473+
For example, the C++ message introspection code generated for {interface(std_msgs/msg/Header)} is at ``std_msgs/rosidl_typesupport_introspection_cpp/std_msgs/msg/detail/header__type_support.cpp`` under the ``build/`` directory.

0 commit comments

Comments
 (0)