Go to the documentation of this file.
18 #ifndef tf2_Transform_H
19 #define tf2_Transform_H
28 #define TransformData TransformDoubleData
80 m_basis = t1.m_basis * t2.m_basis;
134 m_origin.setValue(m[12],m[13],m[14]);
206 return identityTransform;
241 (*
this)(
t.m_origin));
247 return ( t1.getBasis() == t2.getBasis() &&
248 t1.getOrigin() == t2.getOrigin() );
253 struct TransformFloatData
259 struct TransformDoubleData
270 m_origin.serialize(dataOut.m_origin);
276 m_origin.serializeFloat(dataOut.m_origin);
283 m_origin.deSerialize(dataIn.m_origin);
289 m_origin.deSerializeFloat(dataIn.m_origin);
295 m_origin.deSerializeDouble(dataIn.m_origin);
TF2SIMD_FORCE_INLINE tf2Scalar dot(const Quaternion &q1, const Quaternion &q2)
Calculate the dot product between two quaternions.
::geometry_msgs::Vector3_< std::allocator< void > > Vector3
void deSerializeFloat(const struct Matrix3x3FloatData &dataIn)
void getRotation(Quaternion &q) const
static const Matrix3x3 & getIdentity()
void getOpenGLSubMatrix(tf2Scalar *m) const
void setRotation(const Quaternion &q)
Matrix3x3 transposeTimes(const Matrix3x3 &m) const
void deSerialize(const struct Matrix3x3Data &dataIn)
TF2SIMD_FORCE_INLINE bool operator==(const Matrix3x3 &m1, const Matrix3x3 &m2)
Equality operator between two matrices It will test all elements are equal.
void deSerializeDouble(const struct Matrix3x3DoubleData &dataIn)
#define TF2SIMD_FORCE_INLINE
::geometry_msgs::Transform_< std::allocator< void > > Transform
::geometry_msgs::Quaternion_< std::allocator< void > > Quaternion
void setFromOpenGLSubMatrix(const tf2Scalar *m)
void serializeFloat(struct Matrix3x3FloatData &dataOut) const
void serialize(struct Matrix3x3Data &dataOut) const
Matrix3x3 transpose() const
double tf2Scalar
The tf2Scalar type abstracts floating point numbers, to easily switch between double and single float...
geometry_msgs::TransformStamped t
sick_scan_xd
Author(s): Michael Lehning
, Jochen Sprickerhof , Martin Günther
autogenerated on Fri Oct 25 2024 02:47:12