#include <iostream>
#include <iomanip>
#include <cmath>
#include <vector>
#include <sstream>
#include <map>
#include <memory>
#include <tf/exceptions.h>
#include "tf/time_cache.h"
#include <boost/unordered_map.hpp>
#include <boost/signals2.hpp>
#include "geometry_msgs/TwistStamped.h"
#include <tf2_ros/buffer.h>
#include <ros/macros.h>
Go to the source code of this file.
Classes | |
class | tf::Transformer |
A Class which provides coordinate transforms between any two frames in a system. More... | |
struct | tf::TransformLists |
An internal representation of transform chains. More... | |
Namespaces | |
tf | |
Macros | |
#define | TF_DECL |
Enumerations | |
enum | tf::ErrorValues { tf::NO_ERROR = 0, tf::LOOKUP_ERROR, tf::CONNECTIVITY_ERROR, tf::EXTRAPOLATION_ERROR } |
Functions | |
void | tf::assertQuaternionValid (const geometry_msgs::Quaternion &q) |
Throw InvalidArgument if quaternion is malformed. More... | |
void | tf::assertQuaternionValid (const tf::Quaternion &q) |
Throw InvalidArgument if quaternion is malformed. More... | |
static ROS_DEPRECATED std::string | tf::remap (const std::string &prefix, const std::string &frame_name) |
std::string | tf::resolve (const std::string &prefix, const std::string &frame_name) |
resolve tf names More... | |
std::string | tf::strip_leading_slash (const std::string &frame_name) |