Classes | |
class | Buffer |
class | BufferClient |
class | BufferInterface |
class | BufferServer |
class | StaticTransformBroadcaster |
This class provides an easy way to publish coordinate frame transform information. It will handle all the messaging and stuffing of messages. And the function prototypes lay out all the necessary data needed for each message. More... | |
class | TransformBroadcaster |
This class provides an easy way to publish coordinate frame transform information. It will handle all the messaging and stuffing of messages. And the function prototypes lay out all the necessary data needed for each message. More... | |
class | TransformListener |
Functions | |
template<class A > | |
void | convert (const A &a1, A &a2) |
template<class A , class B > | |
void | convert (const A &a, B &b) |
template<class T > | |
void | doTransform (const T &data_in, T &data_out, const geometry_msgs::TransformStamped &transform) |
The templated function expected to be able to do a transform. | |
template<class P > | |
const std::string & | getFrameId (const tf2::Stamped< P > &t) |
template<class T > | |
const std::string & | getFrameId (const T &t) |
Get the frame_id from data. | |
template<class P > | |
const ros::Time & | getTimestamp (const tf2::Stamped< P > &t) |
template<class T > | |
const ros::Time & | getTimestamp (const T &t) |
Get the timestamp from data. |
void tf2::convert | ( | const A & | a1, | |
A & | a2 | |||
) | [inline] |
Definition at line 94 of file buffer_interface.h.
void tf2::convert | ( | const A & | a, | |
B & | b | |||
) | [inline] |
Definition at line 87 of file buffer_interface.h.
void tf2::doTransform | ( | const T & | data_in, | |
T & | data_out, | |||
const geometry_msgs::TransformStamped & | transform | |||
) | [inline] |
The templated function expected to be able to do a transform.
This is the method which tf2 will use to try to apply a transform for any given datatype.
data_in | The data to be transformed. | |
data_out | A reference to the output data. Note this can point to data in and the method should be mutation safe. | |
transform | The transform to apply to data_in to fill data_out. |
This method needs to be implemented by client library developers
const std::string& tf2::getFrameId | ( | const tf2::Stamped< P > & | t | ) | [inline] |
Definition at line 81 of file buffer_interface.h.
const std::string& tf2::getFrameId | ( | const T & | t | ) | [inline] |
Get the frame_id from data.
t | The data input. |
const ros::Time& tf2::getTimestamp | ( | const tf2::Stamped< P > & | t | ) | [inline] |
Definition at line 74 of file buffer_interface.h.
const ros::Time& tf2::getTimestamp | ( | const T & | t | ) | [inline] |
Get the timestamp from data.
t | The data input. |