[Documentation] [TitleIndex] [WordIndex

Documentation

This package provides roscpp and rospy bindings for tf2. Here is a list of the common method that should be used when interacting with tf2 function within ROS.

Broadcasting Transforms

$ROS_DISTRO

Please refer to the C++ API or Python API

Similarly static transforms can be sent by:

Please refer to the C++ API or Python API

Using Published Transforms

For most purposes using tf2_ros will be done using tf2_ros::Buffer. It's main public API is defined by tf2_ros::BufferInterface. Typically it will be populated using a tf2_ros::TransformListener which subscribes to the appropriate topics.

Please refer to the C++ API or Python Api

Filtering Transforms

tf2_ros provides a feature which allows to pass only the messages once there is transform data available. This follows the pattern from the message_filters package. Here is a brief list of functions that the user is most likely to use.

Please refer to the C++ API or Python Api

Exceptions

Here is the list of exceptions that can be thrown by tf2_ros and are inherited from tf2.

For more information see C++ exceptions or Python Exceptions

Tools

static_transform_publisher

static_transform_publisher x y z yaw pitch roll frame_id child_frame_id

static_transform_publisher x y z qx qy qz qw frame_id child_frame_id

Unlike in tf, there is no period argument, and a latched topic is used.

static_transform_publisher is designed both as a command-line tool for manual use, as well as for use within roslaunch files for setting static transforms. For example:

   1 <launch>
   2 <node pkg="tf2_ros" type="static_transform_publisher" name="link1_broadcaster" args="1 0 0 0 0 0 1 link1_parent link1" />
   3 </launch>


2024-06-22 14:20