buffer_core.cpp File Reference

#include "tf2/buffer_core.h"
#include "transform_storage.h"
#include <string>
#include "ros/duration.h"
#include "ros/time.h"
#include "geometry_msgs/TransformStamped.h"
#include "LinearMath/btTransform.h"
#include <boost/unordered_map.hpp>
#include <boost/thread/mutex.hpp>
#include <boost/function.hpp>
#include <list>
#include <sstream>
#include <LinearMath/btVector3.h>
#include <LinearMath/btQuaternion.h>
#include <ros/message_forward.h>
#include <stdexcept>
#include <vector>
#include <ostream>
#include "ros/serialization.h"
#include "ros/builtin_message_traits.h"
#include "ros/message_operations.h"
#include "ros/message.h"
#include <ros/assert.h>
#include <ros/console.h>
Include dependency graph for buffer_core.cpp:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Classes

struct  tf2::CanTransformAccum
struct  tf2::BufferCore::RemoveRequestByCallback
struct  tf2::BufferCore::RemoveRequestByID
struct  tf2::TimeAndFrameIDFrameComparator
struct  tf2::TransformAccum

Namespaces

namespace  tf2

Enumerations

enum  tf2::WalkEnding { tf2::Identity, tf2::TargetParentOfSource, tf2::SourceParentOfTarget, tf2::FullPath }

Functions

void tf2::setIdentity (geometry_msgs::Transform &tx)
bool tf2::startsWithSlash (const std::string &frame_id)
std::string tf2::stripSlash (const std::string &in)
void tf2::transformMsgToTF2 (const geometry_msgs::Transform &msg, btTransform &bt)
 convert Transform msg to Transform
void tf2::transformTF2ToMsg (const btQuaternion &orient, const btVector3 &pos, geometry_msgs::TransformStamped &msg, ros::Time stamp, const std::string &frame_id, const std::string &child_frame_id)
void tf2::transformTF2ToMsg (const btQuaternion &orient, const btVector3 &pos, geometry_msgs::Transform &msg)
void tf2::transformTF2ToMsg (const btTransform &bt, geometry_msgs::TransformStamped &msg, ros::Time stamp, const std::string &frame_id, const std::string &child_frame_id)
 convert Transform to Transform msg
void tf2::transformTF2ToMsg (const btTransform &bt, geometry_msgs::Transform &msg)
 convert Transform to Transform msg
 All Classes Namespaces Files Functions Variables Typedefs Enumerations Enumerator Defines


tf2
Author(s): Tully Foote, Wim Meeussen, Eitan Marder-Eppstein
autogenerated on Fri Jan 11 09:40:01 2013