Namespaces | Classes | Typedefs | Enumerations | Functions | Variables
tf2 Namespace Reference

Namespaces

 cache
 
 impl
 

Classes

class  BufferCore
 A Class which provides coordinate transforms between any two frames in a system.
 
struct  CanTransformAccum
 
class  ConnectivityException
 An exception class to notify of no connection.
 
class  ExtrapolationException
 An exception class to notify that the requested value would have required extrapolation beyond current limits.
 
class  InvalidArgumentException
 An exception class to notify that one of the arguments is invalid.
 
class  LookupException
 An exception class to notify of bad frame number.
 
class  Matrix3x3
 The Matrix3x3 class implements a 3x3 rotation matrix, to perform linear algebra in combination with Quaternion, Transform and Vector3. Make sure to only include a pure orthogonal matrix without scaling.
 
struct  Matrix3x3DoubleData
 for serialization
 
struct  Matrix3x3FloatData
 for serialization
 
class  Quaternion
 The Quaternion implements quaternion to perform linear algebra rotations in combination with Matrix3x3, Vector3 and Transform.
 
class  Stamped
 The data type which will be cross compatable with geometry_msgs This is the tf2 datatype equivilant of a MessageStamped.
 
class  StaticCache
 
class  TestBufferCore
 
class  tf2Vector4
 
struct  TimeAndFrameIDFrameComparator
 
class  TimeCache
 A class to keep a sorted linked list in time This builds and maintains a list of timestamped data. And provides lookup functions to get data out as a function of time.
 
class  TimeCacheInterface
 
class  TimeoutException
 An exception class to notify that a timeout has occured.
 
class  Transform
 The Transform class supports rigid transforms with only translation and rotation and no scaling/shear. It can be used in combination with Vector3, Quaternion and Matrix3x3 linear algebra classes.
 
struct  TransformAccum
 
struct  TransformDoubleData
 
class  TransformException
 A base class for all tf2 exceptions This inherits from ros::exception which inherits from std::runtime_exception.
 
struct  TransformFloatData
 for serialization
 
class  TransformStorage
 Storage for transforms and their parent.
 
struct  Vector3DoubleData
 
struct  Vector3FloatData
 

Typedefs

typedef uint32_t CompactFrameID
 
typedef uint32_t CompactFrameID
 
typedef std::pair< ros::Time, CompactFrameIDP_TimeAndFrameID
 
typedef std::pair< ros::Time, CompactFrameIDP_TimeAndFrameID
 
typedef boost::shared_ptr< TimeCacheInterfaceTimeCacheInterfacePtr
 
typedef std::shared_ptr< TimeCacheInterfaceTimeCacheInterfacePtr
 
typedef uint32_t TransformableCallbackHandle
 
typedef uint32_t TransformableCallbackHandle
 
typedef uint64_t TransformableRequestHandle
 
typedef uint64_t TransformableRequestHandle
 

Enumerations

enum  TransformableResult { TransformAvailable, TransformFailure }
 
enum  TransformableResult { TransformAvailable, TransformFailure }
 
enum  WalkEnding
 

Functions

TF2SIMD_FORCE_INLINE tf2Scalar angle (const Quaternion &q1, const Quaternion &q2)
 Return the half angle between two quaternions. More...
 
TF2SIMD_FORCE_INLINE tf2Scalar angleShortestPath (const Quaternion &q1, const Quaternion &q2)
 Return the shortest angle between two quaternions. More...
 
 ATTRIBUTE_ALIGNED16 (class) QuadWord
 The QuadWord class is base class for Vector3 and Quaternion. Some issues under PS3 Linux with IBM 2.1 SDK, gcc compiler prevent from using aligned quadword. More...
 
void convert (const A &a, B &b)
 
void convert (const A &a1, A &a2)
 
TF2SIMD_FORCE_INLINE tf2Scalar dot (const Quaternion &q1, const Quaternion &q2)
 Calculate the dot product between two quaternions. More...
 
void doTransform (const geometry_msgs::Point &t_in, geometry_msgs::Point &t_out, const geometry_msgs::TransformStamped &transform)
 
void doTransform (const geometry_msgs::PointStamped &t_in, geometry_msgs::PointStamped &t_out, const geometry_msgs::TransformStamped &transform)
 
void doTransform (const geometry_msgs::Pose &t_in, geometry_msgs::Pose &t_out, const geometry_msgs::TransformStamped &transform)
 
void doTransform (const geometry_msgs::PoseStamped &t_in, geometry_msgs::PoseStamped &t_out, const geometry_msgs::TransformStamped &transform)
 
void doTransform (const geometry_msgs::PoseWithCovarianceStamped &t_in, geometry_msgs::PoseWithCovarianceStamped &t_out, const geometry_msgs::TransformStamped &transform)
 
void doTransform (const geometry_msgs::Quaternion &t_in, geometry_msgs::Quaternion &t_out, const geometry_msgs::TransformStamped &transform)
 
void doTransform (const geometry_msgs::QuaternionStamped &t_in, geometry_msgs::QuaternionStamped &t_out, const geometry_msgs::TransformStamped &transform)
 
void doTransform (const geometry_msgs::TransformStamped &t_in, geometry_msgs::TransformStamped &t_out, const geometry_msgs::TransformStamped &transform)
 
void doTransform (const geometry_msgs::Vector3 &t_in, geometry_msgs::Vector3 &t_out, const geometry_msgs::TransformStamped &transform)
 
void doTransform (const geometry_msgs::Vector3Stamped &t_in, geometry_msgs::Vector3Stamped &t_out, const geometry_msgs::TransformStamped &transform)
 
void doTransform (const geometry_msgs::Wrench &t_in, geometry_msgs::Wrench &t_out, const geometry_msgs::TransformStamped &transform)
 
void doTransform (const geometry_msgs::WrenchStamped &t_in, geometry_msgs::WrenchStamped &t_out, const geometry_msgs::TransformStamped &transform)
 
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. More...
 
void fromMsg (const A &, B &b)
 
void fromMsg (const geometry_msgs::Point &in, tf2::Vector3 &out)
 
void fromMsg (const geometry_msgs::PointStamped &msg, geometry_msgs::PointStamped &out)
 
void fromMsg (const geometry_msgs::PointStamped &msg, tf2::Stamped< tf2::Vector3 > &out)
 
void fromMsg (const geometry_msgs::Pose &in, tf2::Transform &out)
 
void fromMsg (const geometry_msgs::PoseStamped &msg, geometry_msgs::PoseStamped &out)
 
void fromMsg (const geometry_msgs::PoseStamped &msg, tf2::Stamped< tf2::Transform > &out)
 
void fromMsg (const geometry_msgs::PoseWithCovarianceStamped &msg, geometry_msgs::PoseWithCovarianceStamped &out)
 
void fromMsg (const geometry_msgs::PoseWithCovarianceStamped &msg, tf2::Stamped< tf2::Transform > &out)
 
void fromMsg (const geometry_msgs::Quaternion &in, tf2::Quaternion &out)
 
void fromMsg (const geometry_msgs::QuaternionStamped &in, tf2::Stamped< tf2::Quaternion > &out)
 
void fromMsg (const geometry_msgs::QuaternionStamped &msg, geometry_msgs::QuaternionStamped &out)
 
void fromMsg (const geometry_msgs::Transform &in, tf2::Transform &out)
 
void fromMsg (const geometry_msgs::TransformStamped &msg, geometry_msgs::TransformStamped &out)
 
void fromMsg (const geometry_msgs::TransformStamped &msg, tf2::Stamped< tf2::Transform > &out)
 
void fromMsg (const geometry_msgs::Vector3 &in, tf2::Vector3 &out)
 
void fromMsg (const geometry_msgs::Vector3Stamped &msg, geometry_msgs::Vector3Stamped &out)
 
void fromMsg (const geometry_msgs::Vector3Stamped &msg, tf2::Stamped< tf2::Vector3 > &out)
 
void fromMsg (const geometry_msgs::WrenchStamped &msg, geometry_msgs::WrenchStamped &out)
 
void fromMsg (const geometry_msgs::WrenchStamped &msg, tf2::Stamped< std::array< tf2::Vector3, 2 >> &out)
 
void getEulerYPR (const A &a, double &yaw, double &pitch, double &roll)
 
const std::string & getFrameId (const geometry_msgs::PointStamped &t)
 
const std::string & getFrameId (const geometry_msgs::PoseStamped &t)
 
const std::string & getFrameId (const geometry_msgs::PoseWithCovarianceStamped &t)
 
const std::string & getFrameId (const geometry_msgs::QuaternionStamped &t)
 
const std::string & getFrameId (const geometry_msgs::TransformStamped &t)
 
const std::string & getFrameId (const geometry_msgs::Vector3Stamped &t)
 
const std::string & getFrameId (const geometry_msgs::WrenchStamped &t)
 
const std::string & getFrameId (const T &t)
 Get the frame_id from data. More...
 
const std::string & getFrameId (const tf2::Stamped< P > &t)
 
const ros::TimegetTimestamp (const geometry_msgs::PointStamped &t)
 
const ros::TimegetTimestamp (const geometry_msgs::PoseStamped &t)
 
const ros::TimegetTimestamp (const geometry_msgs::PoseWithCovarianceStamped &t)
 
const ros::TimegetTimestamp (const geometry_msgs::QuaternionStamped &t)
 
const ros::TimegetTimestamp (const geometry_msgs::TransformStamped &t)
 
const ros::TimegetTimestamp (const geometry_msgs::Vector3Stamped &t)
 
const ros::TimegetTimestamp (const geometry_msgs::WrenchStamped &t)
 
const ros::TimegetTimestamp (const T &t)
 Get the timestamp from data. More...
 
const ros::TimegetTimestamp (const tf2::Stamped< P > &t)
 
A getTransformIdentity ()
 
double getYaw (const A &a)
 
ROS_DEPRECATED KDL::Frame gmTransformToKDL (const geometry_msgs::TransformStamped &t)
 
TF2SIMD_FORCE_INLINE Quaternion inverse (const Quaternion &q)
 Return the inverse of a quaternion. More...
 
TF2SIMD_FORCE_INLINE tf2Scalar length (const Quaternion &q)
 Return the length of a quaternion. More...
 
TF2SIMD_FORCE_INLINE Vector3 lerp (const Vector3 &v1, const Vector3 &v2, const tf2Scalar &t)
 Return the linear interpolation between two vectors. More...
 
TF2SIMD_FORCE_INLINE Vector3 operator* (const Matrix3x3 &m, const Vector3 &v)
 
TF2SIMD_FORCE_INLINE Matrix3x3 operator* (const Matrix3x3 &m1, const Matrix3x3 &m2)
 
TF2SIMD_FORCE_INLINE Quaternion operator* (const Quaternion &q, const Vector3 &w)
 
TF2SIMD_FORCE_INLINE Quaternion operator* (const Quaternion &q1, const Quaternion &q2)
 Return the product of two quaternions. More...
 
TF2SIMD_FORCE_INLINE Vector3 operator* (const tf2Scalar &s, const Vector3 &v)
 Return the vector scaled by s. More...
 
TF2SIMD_FORCE_INLINE Vector3 operator* (const Vector3 &v, const Matrix3x3 &m)
 
TF2SIMD_FORCE_INLINE Vector3 operator* (const Vector3 &v, const tf2Scalar &s)
 Return the vector scaled by s. More...
 
TF2SIMD_FORCE_INLINE Vector3 operator* (const Vector3 &v1, const Vector3 &v2)
 Return the elementwise product of two vectors. More...
 
TF2SIMD_FORCE_INLINE Quaternion operator* (const Vector3 &w, const Quaternion &q)
 
TF2SIMD_FORCE_INLINE Vector3 operator+ (const Vector3 &v1, const Vector3 &v2)
 Return the sum of two vectors (Point symantics) More...
 
TF2SIMD_FORCE_INLINE Quaternion operator- (const Quaternion &q)
 Return the negative of a quaternion. More...
 
TF2SIMD_FORCE_INLINE Vector3 operator- (const Vector3 &v)
 Return the negative of the vector. More...
 
TF2SIMD_FORCE_INLINE Vector3 operator- (const Vector3 &v1, const Vector3 &v2)
 Return the difference between two vectors. More...
 
TF2SIMD_FORCE_INLINE Vector3 operator/ (const Vector3 &v, const tf2Scalar &s)
 Return the vector inversely scaled by s. More...
 
TF2SIMD_FORCE_INLINE Vector3 operator/ (const Vector3 &v1, const Vector3 &v2)
 Return the vector inversely scaled by s. More...
 
TF2SIMD_FORCE_INLINE bool operator== (const Matrix3x3 &m1, const Matrix3x3 &m2)
 Equality operator between two matrices It will test all elements are equal.
More...
 
bool operator== (const Stamped< T > &a, const Stamped< T > &b)
 Comparison Operator for Stamped datatypes. More...
 
TF2SIMD_FORCE_INLINE bool operator== (const Transform &t1, const Transform &t2)
 Test if two transforms have all elements equal. More...
 
bool operator> (const TransformStorage &lhs, const TransformStorage &rhs)
 
TF2SIMD_FORCE_INLINE Vector3 quatRotate (const Quaternion &rotation, const Vector3 &v)
 
void setIdentity (geometry_msgs::Transform &tx)
 
TF2SIMD_FORCE_INLINE Quaternion shortestArcQuat (const Vector3 &v0, const Vector3 &v1)
 
TF2SIMD_FORCE_INLINE Quaternion shortestArcQuatNormalize2 (Vector3 &v0, Vector3 &v1)
 
TF2SIMD_FORCE_INLINE Quaternion slerp (const Quaternion &q1, const Quaternion &q2, const tf2Scalar &t)
 Return the result of spherical linear interpolation betwen two quaternions. More...
 
bool startsWithSlash (const std::string &frame_id)
 
std::string stripSlash (const std::string &in)
 
TF2SIMD_FORCE_INLINE tf2Scalar tf2Angle (const Vector3 &v1, const Vector3 &v2)
 Return the angle between two vectors. More...
 
TF2SIMD_FORCE_INLINE Vector3 tf2Cross (const Vector3 &v1, const Vector3 &v2)
 Return the cross product of two vectors. More...
 
TF2SIMD_FORCE_INLINE tf2Scalar tf2Distance (const Vector3 &v1, const Vector3 &v2)
 Return the distance between two vectors. More...
 
TF2SIMD_FORCE_INLINE tf2Scalar tf2Distance2 (const Vector3 &v1, const Vector3 &v2)
 Return the distance squared between two vectors. More...
 
TF2SIMD_FORCE_INLINE tf2Scalar tf2Dot (const Vector3 &v1, const Vector3 &v2)
 Return the dot product between two vectors. More...
 
TF2SIMD_FORCE_INLINE void tf2PlaneSpace1 (const Vector3 &n, Vector3 &p, Vector3 &q)
 
TF2SIMD_FORCE_INLINE void tf2SwapScalarEndian (const tf2Scalar &sourceVal, tf2Scalar &destVal)
 tf2SwapVector3Endian swaps vector endianness, useful for network and cross-platform serialization More...
 
TF2SIMD_FORCE_INLINE void tf2SwapVector3Endian (const Vector3 &sourceVec, Vector3 &destVec)
 tf2SwapVector3Endian swaps vector endianness, useful for network and cross-platform serialization More...
 
TF2SIMD_FORCE_INLINE tf2Scalar tf2Triple (const Vector3 &v1, const Vector3 &v2, const Vector3 &v3)
 
TF2SIMD_FORCE_INLINE void tf2UnSwapVector3Endian (Vector3 &vector)
 tf2UnSwapVector3Endian swaps vector endianness, useful for network and cross-platform serialization More...
 
toMsg (const A &a)
 
geometry_msgs::PointStamped toMsg (const geometry_msgs::PointStamped &in)
 
geometry_msgs::PoseStamped toMsg (const geometry_msgs::PoseStamped &in)
 
geometry_msgs::PoseWithCovarianceStamped toMsg (const geometry_msgs::PoseWithCovarianceStamped &in)
 
geometry_msgs::QuaternionStamped toMsg (const geometry_msgs::QuaternionStamped &in)
 
geometry_msgs::TransformStamped toMsg (const geometry_msgs::TransformStamped &in)
 
geometry_msgs::Vector3Stamped toMsg (const geometry_msgs::Vector3Stamped &in)
 
geometry_msgs::WrenchStamped toMsg (const geometry_msgs::WrenchStamped &in)
 
geometry_msgs::Quaternion toMsg (const tf2::Quaternion &in)
 
geometry_msgs::WrenchStamped toMsg (const tf2::Stamped< std::array< tf2::Vector3, 2 >> &in, geometry_msgs::WrenchStamped &out)
 
geometry_msgs::QuaternionStamped toMsg (const tf2::Stamped< tf2::Quaternion > &in)
 
geometry_msgs::TransformStamped toMsg (const tf2::Stamped< tf2::Transform > &in)
 
geometry_msgs::PoseStamped toMsg (const tf2::Stamped< tf2::Transform > &in, geometry_msgs::PoseStamped &out)
 
geometry_msgs::PoseWithCovarianceStamped toMsg (const tf2::Stamped< tf2::Transform > &in, geometry_msgs::PoseWithCovarianceStamped &out)
 
geometry_msgs::Vector3Stamped toMsg (const tf2::Stamped< tf2::Vector3 > &in)
 
geometry_msgs::PointStamped toMsg (const tf2::Stamped< tf2::Vector3 > &in, geometry_msgs::PointStamped &out)
 
geometry_msgs::Transform toMsg (const tf2::Transform &in)
 
geometry_msgs::PosetoMsg (const tf2::Transform &in, geometry_msgs::Pose &out)
 
geometry_msgs::Vector3 toMsg (const tf2::Vector3 &in)
 
geometry_msgs::PointtoMsg (const tf2::Vector3 &in, geometry_msgs::Point &out)
 
geometry_msgs::PoseWithCovariance::_covariance_type transformCovariance (const geometry_msgs::PoseWithCovariance::_covariance_type &cov_in, const tf2::Transform &transform)
 
void transformMsgToTF2 (const geometry_msgs::Transform &msg, tf2::Transform &tf2)
 
void transformTF2ToMsg (const tf2::Quaternion &orient, const tf2::Vector3 &pos, geometry_msgs::Transform &msg)
 
void 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)
 
void transformTF2ToMsg (const tf2::Transform &tf2, geometry_msgs::Transform &msg)
 
void transformTF2ToMsg (const tf2::Transform &tf2, geometry_msgs::TransformStamped &msg, ros::Time stamp, const std::string &frame_id, const std::string &child_frame_id)
 

Variables

 FullPath
 
 Identity
 
static double QUATERNION_NORMALIZATION_TOLERANCE
 
 SourceParentOfTarget
 
 TargetParentOfSource
 
 TransformAvailable
 
 TransformFailure
 

Typedef Documentation

◆ CompactFrameID

typedef uint32_t tf2::CompactFrameID

Definition at line 51 of file transform_storage.h.

◆ P_TimeAndFrameID

Definition at line 58 of file buffer_core.h.

◆ TimeCacheInterfacePtr

Definition at line 62 of file buffer_core.h.

◆ TransformableCallbackHandle

Definition at line 59 of file buffer_core.h.

◆ TransformableRequestHandle

Definition at line 60 of file buffer_core.h.

Enumeration Type Documentation

◆ TransformableResult

Enumerator
TransformAvailable 
TransformFailure 

Definition at line 65 of file buffer_core.h.



sick_scan_xd
Author(s): Michael Lehning , Jochen Sprickerhof , Martin Günther
autogenerated on Fri Oct 25 2024 02:47:21