Classes | Namespaces | Enumerations | Functions | Variables
buffer_core.cpp File Reference
#include "tf2/buffer_core.h"
#include "tf2/time_cache.h"
#include "tf2/exceptions.h"
#include "tf2_msgs/TF2Error.h"
#include <assert.h>
#include <console_bridge/console.h>
#include "tf2/LinearMath/Transform.h"
#include <boost/foreach.hpp>
Include dependency graph for buffer_core.cpp:

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, tf2::Transform &tf2)
 convert Transform msg to Transform
void tf2::transformTF2ToMsg (const tf2::Transform &tf2, geometry_msgs::Transform &msg)
 convert Transform to Transform msg
void tf2::transformTF2ToMsg (const tf2::Transform &tf2, 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 tf2::Quaternion &orient, const tf2::Vector3 &pos, geometry_msgs::Transform &msg)
void tf2::transformTF2ToMsg (const tf2::Quaternion &orient, const tf2::Vector3 &pos, geometry_msgs::TransformStamped &msg, ros::Time stamp, const std::string &frame_id, const std::string &child_frame_id)

Variables

static double tf2::QUATERNION_NORMALIZATION_TOLERANCE = 10e-3


tf2
Author(s): Tully Foote, Eitan Marder-Eppstein, Wim Meeussen
autogenerated on Mon Oct 2 2017 02:24:34