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

Namespaces

 filter_failure_reasons
 

Classes

class  Matrix3x3
 
struct  Matrix3x3DoubleData
 
struct  Matrix3x3FloatData
 
class  MessageFilter
 
class  MessageFilterBase
 
class  Quaternion
 
class  Stamped
 
class  StampedTransform
 
class  tfVector4
 
class  TimeCache
 
class  Transform
 
class  TransformBroadcaster
 
struct  TransformDoubleData
 
class  Transformer
 
struct  TransformFloatData
 
class  TransformListener
 
struct  TransformLists
 
class  TransformStorage
 
struct  Vector3DoubleData
 
struct  Vector3FloatData
 

Typedefs

typedef uint32_t CompactFrameID
 
typedef tf2::ConnectivityException ConnectivityException
 
typedef tf2::ExtrapolationException ExtrapolationException
 
typedef filter_failure_reasons::FilterFailureReason FilterFailureReason
 
typedef tf2::InvalidArgumentException InvalidArgument
 
typedef tf2::LookupException LookupException
 
typedef btMatrix3x3 Matrix3x3
 
typedef std::pair< ros::Time, CompactFrameIDP_TimeAndFrameID
 
typedef tf::Vector3 Point
 
typedef tf::Transform Pose
 
typedef tf2::TransformException TransformException
 

Enumerations

enum  ErrorValues
 
enum  ExtrapolationMode
 

Functions

TFSIMD_FORCE_INLINE tfScalar angle (const Quaternion &q1, const Quaternion &q2)
 
TFSIMD_FORCE_INLINE tfScalar angleShortestPath (const Quaternion &q1, const Quaternion &q2)
 
void assertQuaternionValid (const geometry_msgs::Quaternion &q)
 
void assertQuaternionValid (const tf::Quaternion &q)
 
 ATTRIBUTE_ALIGNED16 (class) QuadWord
 
static tf::Quaternion createIdentityQuaternion ()
 
static tf::Quaternion createQuaternionFromRPY (double roll, double pitch, double yaw)
 
static Quaternion createQuaternionFromYaw (double yaw)
 
static geometry_msgs::Quaternion createQuaternionMsgFromRollPitchYaw (double roll, double pitch, double yaw)
 
static geometry_msgs::Quaternion createQuaternionMsgFromYaw (double yaw)
 
TFSIMD_FORCE_INLINE tfScalar dot (const Quaternion &q1, const Quaternion &q2)
 
std::string getPrefixParam (ros::NodeHandle &nh)
 
static double getYaw (const Quaternion &bt_q)
 
static double getYaw (const geometry_msgs::Quaternion &msg_q)
 
TFSIMD_FORCE_INLINE Quaternion inverse (const Quaternion &q)
 
TFSIMD_FORCE_INLINE tfScalar length (const Quaternion &q)
 
TFSIMD_FORCE_INLINE Vector3 lerp (const Vector3 &v1, const Vector3 &v2, const tfScalar &t)
 
TFSIMD_FORCE_INLINE Vector3 operator* (const Vector3 &v1, const Vector3 &v2)
 
TFSIMD_FORCE_INLINE Quaternion operator* (const Quaternion &q1, const Quaternion &q2)
 
TFSIMD_FORCE_INLINE Quaternion operator* (const Quaternion &q, const Vector3 &w)
 
TFSIMD_FORCE_INLINE Vector3 operator* (const Vector3 &v, const tfScalar &s)
 
TFSIMD_FORCE_INLINE Quaternion operator* (const Vector3 &w, const Quaternion &q)
 
TFSIMD_FORCE_INLINE Vector3 operator* (const tfScalar &s, const Vector3 &v)
 
TFSIMD_FORCE_INLINE Vector3 operator* (const Matrix3x3 &m, const Vector3 &v)
 
TFSIMD_FORCE_INLINE Vector3 operator* (const Vector3 &v, const Matrix3x3 &m)
 
TFSIMD_FORCE_INLINE Matrix3x3 operator* (const Matrix3x3 &m1, const Matrix3x3 &m2)
 
TFSIMD_FORCE_INLINE Vector3 operator+ (const Vector3 &v1, const Vector3 &v2)
 
TFSIMD_FORCE_INLINE Quaternion operator- (const Quaternion &q)
 
TFSIMD_FORCE_INLINE Vector3 operator- (const Vector3 &v1, const Vector3 &v2)
 
TFSIMD_FORCE_INLINE Vector3 operator- (const Vector3 &v)
 
TFSIMD_FORCE_INLINE Vector3 operator/ (const Vector3 &v1, const Vector3 &v2)
 
TFSIMD_FORCE_INLINE Vector3 operator/ (const Vector3 &v, const tfScalar &s)
 
bool operator== (const Stamped< T > &a, const Stamped< T > &b)
 
static bool operator== (const StampedTransform &a, const StampedTransform &b)
 
TFSIMD_FORCE_INLINE bool operator== (const Transform &t1, const Transform &t2)
 
TFSIMD_FORCE_INLINE bool operator== (const Matrix3x3 &m1, const Matrix3x3 &m2)
 
static void pointMsgToTF (const geometry_msgs::Point &msg_v, Point &bt_v)
 
static void pointStampedMsgToTF (const geometry_msgs::PointStamped &msg, Stamped< Point > &bt)
 
static void pointStampedTFToMsg (const Stamped< Point > &bt, geometry_msgs::PointStamped &msg)
 
static void pointTFToMsg (const Point &bt_v, geometry_msgs::Point &msg_v)
 
static void poseMsgToTF (const geometry_msgs::Pose &msg, Pose &bt)
 
static void poseStampedMsgToTF (const geometry_msgs::PoseStamped &msg, Stamped< Pose > &bt)
 
static void poseStampedTFToMsg (const Stamped< Pose > &bt, geometry_msgs::PoseStamped &msg)
 
static void poseTFToMsg (const Pose &bt, geometry_msgs::Pose &msg)
 
static void quaternionMsgToTF (const geometry_msgs::Quaternion &msg, Quaternion &bt)
 
static void quaternionStampedMsgToTF (const geometry_msgs::QuaternionStamped &msg, Stamped< Quaternion > &bt)
 
static void quaternionStampedTFToMsg (const Stamped< Quaternion > &bt, geometry_msgs::QuaternionStamped &msg)
 
static void quaternionTFToMsg (const Quaternion &bt, geometry_msgs::Quaternion &msg)
 
TFSIMD_FORCE_INLINE Vector3 quatRotate (const Quaternion &rotation, const Vector3 &v)
 
ROS_DEPRECATED std::string remap (const std::string &frame_id)
 
static ROS_DEPRECATED std::string remap (const std::string &prefix, const std::string &frame_name)
 
std::string resolve (const std::string &prefix, const std::string &frame_name)
 
TFSIMD_FORCE_INLINE Quaternion shortestArcQuat (const Vector3 &v0, const Vector3 &v1)
 
TFSIMD_FORCE_INLINE Quaternion shortestArcQuatNormalize2 (Vector3 &v0, Vector3 &v1)
 
TFSIMD_FORCE_INLINE Quaternion slerp (const Quaternion &q1, const Quaternion &q2, const tfScalar &t)
 
std::string strip_leading_slash (const std::string &frame_name)
 
TFSIMD_FORCE_INLINE tfScalar tfAngle (const Vector3 &v1, const Vector3 &v2)
 
TFSIMD_FORCE_INLINE Vector3 tfCross (const Vector3 &v1, const Vector3 &v2)
 
TFSIMD_FORCE_INLINE tfScalar tfDistance (const Vector3 &v1, const Vector3 &v2)
 
TFSIMD_FORCE_INLINE tfScalar tfDistance2 (const Vector3 &v1, const Vector3 &v2)
 
TFSIMD_FORCE_INLINE tfScalar tfDot (const Vector3 &v1, const Vector3 &v2)
 
TFSIMD_FORCE_INLINE void tfPlaneSpace1 (const Vector3 &n, Vector3 &p, Vector3 &q)
 
TFSIMD_FORCE_INLINE void tfSwapScalarEndian (const tfScalar &sourceVal, tfScalar &destVal)
 
TFSIMD_FORCE_INLINE void tfSwapVector3Endian (const Vector3 &sourceVec, Vector3 &destVec)
 
TFSIMD_FORCE_INLINE tfScalar tfTriple (const Vector3 &v1, const Vector3 &v2, const Vector3 &v3)
 
TFSIMD_FORCE_INLINE void tfUnSwapVector3Endian (Vector3 &vector)
 
static void transformMsgToTF (const geometry_msgs::Transform &msg, Transform &bt)
 
static void transformStampedMsgToTF (const geometry_msgs::TransformStamped &msg, StampedTransform &bt)
 
static void transformStampedTFToMsg (const StampedTransform &bt, geometry_msgs::TransformStamped &msg)
 
static void transformTFToMsg (const Transform &bt, geometry_msgs::Transform &msg)
 
static void vector3MsgToTF (const geometry_msgs::Vector3 &msg_v, Vector3 &bt_v)
 
static void vector3StampedMsgToTF (const geometry_msgs::Vector3Stamped &msg, Stamped< Vector3 > &bt)
 
static void vector3StampedTFToMsg (const Stamped< Vector3 > &bt, geometry_msgs::Vector3Stamped &msg)
 
static void vector3TFToMsg (const Vector3 &bt_v, geometry_msgs::Vector3 &msg_v)
 

Variables

 CONNECTIVITY_ERROR
 
 EXTRAPOLATE_BACK
 
 EXTRAPOLATE_FORWARD
 
 EXTRAPOLATION_ERROR
 
 INTERPOLATE
 
 LOOKUP_ERROR
 
 NO_ERROR
 
 ONE_VALUE
 
static const double QUATERNION_TOLERANCE
 

Typedef Documentation

◆ Matrix3x3

typedef btMatrix3x3 tf::Matrix3x3

Definition at line 62 of file pose_and_orientation_to_imu_node.cpp.



hector_imu_tools
Author(s): Stefan Kohlbrecher
autogenerated on Sat Mar 12 2022 03:57:46