#include <tf2/buffer_core.h>#include <tf2/transform_datatypes.h>#include <tf2/exceptions.h>#include <geometry_msgs/TransformStamped.h>#include <sstream>

Go to the source code of this file.
Classes | |
| class | tf2::BufferInterface |
Namespaces | |
| namespace | tf2 |
Functions | |
| template<class A , class B > | |
| void | tf2::convert (const A &a, B &b) |
| template<class A > | |
| void | tf2::convert (const A &a1, A &a2) |
| template<class T > | |
| void | tf2::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 T > | |
| const std::string & | tf2::getFrameId (const T &t) |
| Get the frame_id from data. | |
| template<class P > | |
| const std::string & | tf2::getFrameId (const tf2::Stamped< P > &t) |
| template<class T > | |
| const ros::Time & | tf2::getTimestamp (const T &t) |
| Get the timestamp from data. | |
| template<class P > | |
| const ros::Time & | tf2::getTimestamp (const tf2::Stamped< P > &t) |