Gazebo Math

API Reference

8.0.0~pre1

A quaternion class that represents 3D rotations and orientations. Four scalar values, [w,x,y,z], are used represent orientations and rotations. More...

#include <gz/math/Quaternion.hh>

Public Member Functions

constexpr Quaternion ()
 Default Constructor.
 
 Quaternion (const Matrix3< T > &_mat)
 Construct from rotation matrix. This constructor does not normalize the quaternion.
 
 Quaternion (const T &_roll, const T &_pitch, const T &_yaw)
 Construct a Quaternion from Euler angles, in radians. This constructor normalizes the quaternion.
 
constexpr Quaternion (const T &_w, const T &_x, const T &_y, const T &_z)
 Constructor that initializes each value, [w, x, y, z], of the quaternion. This constructor does not normalize the quaternion.
 
 Quaternion (const Vector3< T > &_axis, const T &_angle)
 Constructor from an axis and angle. This constructor normalizes the quaternion.
 
 Quaternion (const Vector3< T > &_rpy)
 Construct a Quaternion from Euler angles, in radians. This constructor normalizes the quaternion.
 
void AxisAngle (Vector3< T > &_axis, T &_angle) const
 Convert this quaternion to an axis and angle.
 
void Correct ()
 Correct any nan values in this quaternion.
 
Dot (const Quaternion< T > &_q) const
 Get the dot product of this quaternion with the give _q quaternion.
 
bool Equal (const Quaternion &_q, const T &_tol) const
 Equality comparison test with a tolerance parameter. The tolerance is used with the equal function for each component of the quaternions.
 
Vector3< T > Euler () const
 Return the rotation in Euler angles, in radians.
 
Quaternion< T > Exp () const
 Return the exponent.
 
Quaternion< T > Integrate (const Vector3< T > &_angularVelocity, const T _deltaT) const
 Integrate quaternion for constant angular velocity vector along specified interval _deltaT. Implementation based on: http://physicsforgames.blogspot.com/2010/02/quaternions.html.
 
Quaternion< T > Inverse () const
 Get the inverse of this quaternion.
 
void Invert ()
 Invert the quaternion. The quaternion is first normalized, then inverted.
 
bool IsFinite () const
 See if a quaternion is finite (e.g., not nan).
 
Quaternion< T > Log () const
 Return the logarithm.
 
void Normalize ()
 Normalize the quaternion.
 
Quaternion< T > Normalized () const
 Gets a normalized version of this quaternion.
 
bool operator!= (const Quaternion< T > &_qt) const
 Not equal to operator. A tolerance of 0.001 is used with the equal function for each component of the quaternions.
 
Quaternion< T > operator* (const Quaternion< T > &_q) const
 Multiplication operator.
 
Quaternion< T > operator* (const T &_f) const
 Multiplication operator by a scalar.
 
Vector3< T > operator* (const Vector3< T > &_v) const
 Vector3 multiplication operator.
 
Quaternion< T > operator*= (const Quaternion< T > &_qt)
 Multiplication set operator.
 
Quaternion< T > operator+ (const Quaternion< T > &_qt) const
 Addition operator.
 
Quaternion< T > operator+= (const Quaternion< T > &_qt)
 Addition set operator.
 
Quaternion< T > operator- () const
 Unary minus operator.
 
Quaternion< T > operator- (const Quaternion< T > &_qt) const
 Subtraction operator.
 
Quaternion< T > operator-= (const Quaternion< T > &_qt)
 Subtraction set operator.
 
bool operator== (const Quaternion< T > &_qt) const
 Equality comparison operator. A tolerance of 0.001 is used with the equal function for each component of the quaternions.
 
Pitch () const
 Get the Euler pitch angle in radians.
 
Roll () const
 Get the Euler roll angle in radians.
 
Vector3< T > RotateVector (const Vector3< T > &_vec) const
 Rotate a vector using the quaternion.
 
Vector3< T > RotateVectorReverse (const Vector3< T > &_vec) const
 Get the reverse rotation of a vector by this quaternion.
 
void Round (int _precision)
 Round all values to _precision decimal places.
 
void Scale (T _scale)
 Scale this quaternion.
 
void Set (T _w, T _x, T _y, T _z)
 Set this quaternion from 4 floating numbers.
 
void SetFrom2Axes (const Vector3< T > &_v1, const Vector3< T > &_v2)
 Set this quaternion to represent rotation from vector _v1 to vector _v2, so that _v2.Normalize() == this * _v1.Normalize() holds.
 
void SetFromAxisAngle (const Vector3< T > &_axis, T _a)
 Set the quaternion from an axis and angle.
 
void SetFromAxisAngle (T _ax, T _ay, T _az, T _aa)
 Set the quaternion from an axis and angle.
 
void SetFromEuler (const Vector3< T > &_vec)
 Set the quaternion from Euler angles. The order of operations is roll, pitch, yaw around a fixed body frame axis (the original frame of the object before rotation is applied). Roll is a rotation about x, pitch is about y, yaw is about z.
 
void SetFromEuler (T _roll, T _pitch, T _yaw)
 Set the quaternion from Euler angles.
 
void SetFromMatrix (const Matrix3< T > &_mat)
 Set from a rotation matrix.
 
void SetW (T _v)
 Set the w component.
 
void SetX (T _v)
 Set the x component.
 
void SetY (T _v)
 Set the y component.
 
void SetZ (T _v)
 Set the z component.
 
T & W ()
 Get a mutable w component.
 
W () const
 Get the w component.
 
T & X ()
 Get a mutable x component.
 
X () const
 Get the x component.
 
Vector3< T > XAxis () const
 Return the X axis.
 
T & Y ()
 Get a mutable y component.
 
Y () const
 Get the y component.
 
Yaw () const
 Get the Euler yaw angle in radians.
 
Vector3< T > YAxis () const
 Return the Y axis.
 
T & Z ()
 Get a mutable z component.
 
Z () const
 Get the z component.
 
Vector3< T > ZAxis () const
 Return the Z axis.
 

Static Public Member Functions

static Quaternion< T > EulerToQuaternion (const Vector3< T > &_vec)
 Convert Euler angles to a quaternion.
 
static Quaternion< T > EulerToQuaternion (T _x, T _y, T _z)
 Convert Euler angles, in radians, to a quaternion.
 
static Quaternion< T > Slerp (T _fT, const Quaternion< T > &_rkP, const Quaternion< T > &_rkQ, bool _shortestPath=false)
 Spherical linear interpolation between 2 quaternions, given the ends and an interpolation parameter between 0 and 1.
 
static Quaternion< T > Squad (T _fT, const Quaternion< T > &_rkP, const Quaternion< T > &_rkA, const Quaternion< T > &_rkB, const Quaternion< T > &_rkQ, bool _shortestPath=false)
 Spherical quadratic interpolation given the ends and an interpolation parameter between 0 and 1.
 

Static Public Attributes

static const QuaternionIdentity = detail::gQuaternionIdentity<T>
 A Quaternion initialized to identity. This is equivalent to math::Quaternion<T>(1, 0, 0, 0)
 
static const QuaternionZero = detail::gQuaternionZero<T>
 A Quaternion initialized to zero. This is equivalent to math::Quaternion<T>(0, 0, 0, 0)
 

Detailed Description

template<typename T>
class gz::math::Quaternion< T >

A quaternion class that represents 3D rotations and orientations. Four scalar values, [w,x,y,z], are used represent orientations and rotations.

The following two type definitions are provided:

Examples

  • C++
#include <stdio.h>
int main(int argc, char **argv)
{
// Construct a default quaternion.
printf("A default quaternion has the following values\n" \
"\tW=%f X=%f Y=%f Z=%f\n", q.W(), q.X(), q.Y(), q.Z());
// Set the quaternion to [1, 0, 0, 0], the identity.
printf("The identity quaternion has the following values\n" \
"\tW=%f X=%f Y=%f Z=%f\n", q.W(), q.X(), q.Y(), q.Z());
// Create a new quaternion using Euler angles.
printf("A quaternion initialized from roll=0, pitch=0, and yaw=3.14 has"\
"the following values\n" \
"\tW=%f X=%f Y=%f Z=%f\n", q2.W(), q2.X(), q2.Y(), q2.Z());
// Get the Euler angles back from the quaternion.
printf("Getting back the euler angles from the quaternion\n"\
"\troll=%f pitch=%f yaw=%f\n", euler.X(), euler.Y(), euler.Z());
}
  • Ruby
# Modify the RUBYLIB environment variable to include the Gazebo Math
# library install path. For example, if you install to /user:
#
# $ export RUBYLIB=/usr/lib/ruby:$RUBYLIB
#
require 'gz/math'
q = Gz::Math::Quaterniond.new
printf("A default quaternion has the following values\n"+
"\tW=%f X=%f Y=%f Z=%f\n", q.W(), q.X(), q.Y(), q.Z())
q = Gz::Math::Quaterniond.Identity
printf("The identity quaternion has the following values\n" +
"\tW=%f X=%f Y=%f Z=%f\n", q.W(), q.X(), q.Y(), q.Z())
q2 = Gz::Math::Quaterniond.new(0, 0, 3.14)
printf("A quaternion initialized from roll=0, pitch=0, and yaw=3.14 " +
"has the following values\n" +
"\tW=%f X=%f Y=%f Z=%f\n", q2.W(), q2.X(), q2.Y(), q2.Z())
euler = q2.Euler()
printf("Getting back the euler angles from the quaternion\n" +
"\troll=%f pitch=%f yaw=%f\n", euler.X(), euler.Y(), euler.Z())

Constructor & Destructor Documentation

◆ Quaternion() [1/6]

template<typename T >
constexpr Quaternion ( )
inlineconstexpr

Default Constructor.

◆ Quaternion() [2/6]

template<typename T >
constexpr Quaternion ( const T &  _w,
const T &  _x,
const T &  _y,
const T &  _z 
)
inlineconstexpr

Constructor that initializes each value, [w, x, y, z], of the quaternion. This constructor does not normalize the quaternion.

Parameters
[in]_wW param
[in]_xX param
[in]_yY param
[in]_zZ param

◆ Quaternion() [3/6]

template<typename T >
Quaternion ( const T &  _roll,
const T &  _pitch,
const T &  _yaw 
)
inline

Construct a Quaternion from Euler angles, in radians. This constructor normalizes the quaternion.

Parameters
[in]_rollRoll radians.
[in]_pitchPitch radians.
[in]_yawYaw radians.
See also
SetFromEuler(T, T, T)

References Quaternion< T >::SetFromEuler().

◆ Quaternion() [4/6]

template<typename T >
Quaternion ( const Vector3< T > &  _axis,
const T &  _angle 
)
inline

Constructor from an axis and angle. This constructor normalizes the quaternion.

Parameters
[in]_axisThe rotation axis.
[in]_angleThe rotation angle in radians.

References Quaternion< T >::SetFromAxisAngle().

◆ Quaternion() [5/6]

template<typename T >
Quaternion ( const Vector3< T > &  _rpy)
inlineexplicit

Construct a Quaternion from Euler angles, in radians. This constructor normalizes the quaternion.

Parameters
[in]_rpyEuler angles in radians.

References Quaternion< T >::SetFromEuler().

◆ Quaternion() [6/6]

template<typename T >
Quaternion ( const Matrix3< T > &  _mat)
inlineexplicit

Construct from rotation matrix. This constructor does not normalize the quaternion.

Parameters
[in]_matRotation matrix (must be orthogonal, the function doesn't check it)

References Quaternion< T >::SetFromMatrix().

Member Function Documentation

◆ AxisAngle()

template<typename T >
void AxisAngle ( Vector3< T > &  _axis,
T &  _angle 
) const
inline

Convert this quaternion to an axis and angle.

Parameters
[out]_axisRotation axis.
[out]_angleCCW angle in radians.

References Matrix6< T >::Set().

Referenced by Quaternion< T >::Scale().

◆ Correct()

template<typename T >
void Correct ( )
inline

Correct any nan values in this quaternion.

References gz::math::equal(), and std::isfinite().

◆ Dot()

template<typename T >
T Dot ( const Quaternion< T > &  _q) const
inline

Get the dot product of this quaternion with the give _q quaternion.

Parameters
[in]_qThe other quaternion.
Returns
The dot product.

◆ Equal()

template<typename T >
bool Equal ( const Quaternion< T > &  _q,
const T &  _tol 
) const
inline

Equality comparison test with a tolerance parameter. The tolerance is used with the equal function for each component of the quaternions.

Parameters
[in]_qThe quaternion to compare against.
[in]_tolequality tolerance.
Returns
True if the elements of the quaternions are equal within the tolerence specified by _tol.

References gz::math::equal().

Referenced by Quaternion< T >::operator==().

◆ Euler()

template<typename T >
Vector3< T > Euler ( ) const
inline

Return the rotation in Euler angles, in radians.

Returns
This quaternion as Euler angles.

References GZ_PI.

Referenced by Quaternion< T >::Pitch(), Quaternion< T >::Roll(), and Quaternion< T >::Yaw().

◆ EulerToQuaternion() [1/2]

template<typename T >
static Quaternion< T > EulerToQuaternion ( const Vector3< T > &  _vec)
inlinestatic

Convert Euler angles to a quaternion.

Parameters
[in]_vecThe vector of angles, in radians, to convert.
Returns
The resulting quaternion

Referenced by Quaternion< T >::EulerToQuaternion().

◆ EulerToQuaternion() [2/2]

template<typename T >
static Quaternion< T > EulerToQuaternion ( _x,
_y,
_z 
)
inlinestatic

Convert Euler angles, in radians, to a quaternion.

Parameters
[in]_xrotation along x in radians
[in]_yrotation along y in radians
[in]_zrotation along z in radians
Returns
The resulting quaternion.

References Quaternion< T >::EulerToQuaternion().

◆ Exp()

template<typename T >
Quaternion< T > Exp ( ) const
inline

Return the exponent.

If q = A*(x*i+y*j+z*k) where (x, y, z) is unit length, then exp(q) = cos(A)+sin(A)*(x*i+y*j+z*k). If sin(A) is near zero, use exp(q) = cos(A)+A*(x*i+y*j+z*k) since A/sin(A) has limit 1.

Returns
The exponent.

◆ Integrate()

template<typename T >
Quaternion< T > Integrate ( const Vector3< T > &  _angularVelocity,
const _deltaT 
) const
inline

Integrate quaternion for constant angular velocity vector along specified interval _deltaT. Implementation based on: http://physicsforgames.blogspot.com/2010/02/quaternions.html.

Parameters
[in]_angularVelocityAngular velocity vector, specified in same reference frame as base of this quaternion.
[in]_deltaTTime interval in seconds to integrate over.
Returns
Quaternion at integrated configuration.

References gz::math::MIN_D.

◆ Inverse()

template<typename T >
Quaternion< T > Inverse ( ) const
inline

Get the inverse of this quaternion.

Returns
Inverse quaternion

Referenced by Quaternion< T >::RotateVector(), and Quaternion< T >::RotateVectorReverse().

◆ Invert()

template<typename T >
void Invert ( )
inline

Invert the quaternion. The quaternion is first normalized, then inverted.

References Quaternion< T >::Normalize().

◆ IsFinite()

template<typename T >
bool IsFinite ( ) const
inline

See if a quaternion is finite (e.g., not nan).

Returns
True if quaternion is finite.

References std::isfinite().

◆ Log()

template<typename T >
Quaternion< T > Log ( ) const
inline

Return the logarithm.

If q = cos(A)+sin(A)*(x*i+y*j+z*k) where (x, y, z) is unit length, then log(q) = A*(x*i+y*j+z*k). If sin(A) is near zero, use log(q) = sin(A)*(x*i+y*j+z*k) since sin(A)/A has limit 1.

Returns
The log.

◆ Normalize()

◆ Normalized()

template<typename T >
Quaternion< T > Normalized ( ) const
inline

Gets a normalized version of this quaternion.

Returns
a normalized quaternion

◆ operator!=()

template<typename T >
bool operator!= ( const Quaternion< T > &  _qt) const
inline

Not equal to operator. A tolerance of 0.001 is used with the equal function for each component of the quaternions.

Parameters
[in]_qtQuaternion for comparison.
Returns
True if any component of both quaternions is not within the tolerance of 0.001 of its counterpart.

◆ operator*() [1/3]

template<typename T >
Quaternion< T > operator* ( const Quaternion< T > &  _q) const
inline

Multiplication operator.

Parameters
[in]_qQuaternion for multiplication.
Returns
This quaternion multiplied by the parameter.

◆ operator*() [2/3]

template<typename T >
Quaternion< T > operator* ( const T &  _f) const
inline

Multiplication operator by a scalar.

Parameters
[in]_fFactor.
Returns
Quaternion multiplied by the scalar.

◆ operator*() [3/3]

template<typename T >
Vector3< T > operator* ( const Vector3< T > &  _v) const
inline

Vector3 multiplication operator.

Parameters
[in]_vvector to multiply.
Returns
The result of the vector multiplication.

◆ operator*=()

template<typename T >
Quaternion< T > operator*= ( const Quaternion< T > &  _qt)
inline

Multiplication set operator.

Parameters
[in]_qtQuaternion<T> for multiplication.
Returns
This quaternion multiplied by the parameter.

◆ operator+()

template<typename T >
Quaternion< T > operator+ ( const Quaternion< T > &  _qt) const
inline

Addition operator.

Parameters
[in]_qtQuaternion for addition.
Returns
This quaternion + _qt.

◆ operator+=()

template<typename T >
Quaternion< T > operator+= ( const Quaternion< T > &  _qt)
inline

Addition set operator.

Parameters
[in]_qtQuaternion for addition.
Returns
This quaternion + qt.

◆ operator-() [1/2]

template<typename T >
Quaternion< T > operator- ( ) const
inline

Unary minus operator.

Returns
Negation of each component of this quaternion.

◆ operator-() [2/2]

template<typename T >
Quaternion< T > operator- ( const Quaternion< T > &  _qt) const
inline

Subtraction operator.

Parameters
[in]_qtQuaternion to subtract.
Returns
This quaternion - _qt

◆ operator-=()

template<typename T >
Quaternion< T > operator-= ( const Quaternion< T > &  _qt)
inline

Subtraction set operator.

Parameters
[in]_qtQuaternion for subtraction.
Returns
This quaternion - qt.

◆ operator==()

template<typename T >
bool operator== ( const Quaternion< T > &  _qt) const
inline

Equality comparison operator. A tolerance of 0.001 is used with the equal function for each component of the quaternions.

Parameters
[in]_qtQuaternion<T> for comparison.
Returns
True if each component of both quaternions is within the tolerance of 0.001 of its counterpart.

References Quaternion< T >::Equal().

◆ Pitch()

template<typename T >
T Pitch ( ) const
inline

Get the Euler pitch angle in radians.

Returns
The pitch component.

References Quaternion< T >::Euler().

◆ Roll()

template<typename T >
T Roll ( ) const
inline

Get the Euler roll angle in radians.

Returns
The roll component.

References Quaternion< T >::Euler().

◆ RotateVector()

template<typename T >
Vector3< T > RotateVector ( const Vector3< T > &  _vec) const
inline

Rotate a vector using the quaternion.

Parameters
[in]_vecVector to rotate.
Returns
The rotated vector.

References Quaternion< T >::Inverse().

◆ RotateVectorReverse()

template<typename T >
Vector3< T > RotateVectorReverse ( const Vector3< T > &  _vec) const
inline

Get the reverse rotation of a vector by this quaternion.

Parameters
[in]_vecThe vector.
Returns
The reversed vector.

References Quaternion< T >::Inverse().

◆ Round()

template<typename T >
void Round ( int  _precision)
inline

Round all values to _precision decimal places.

Parameters
[in]_precisionthe precision.

References gz::math::precision().

◆ Scale()

template<typename T >
void Scale ( _scale)
inline

Scale this quaternion.

Parameters
[in]_scaleAmount to scale this quaternion

References Quaternion< T >::AxisAngle(), and Quaternion< T >::SetFromAxisAngle().

◆ Set()

template<typename T >
void Set ( _w,
_x,
_y,
_z 
)
inline

Set this quaternion from 4 floating numbers.

Parameters
[in]_ww
[in]_xx
[in]_yy
[in]_zz

◆ SetFrom2Axes()

template<typename T >
void SetFrom2Axes ( const Vector3< T > &  _v1,
const Vector3< T > &  _v2 
)
inline

Set this quaternion to represent rotation from vector _v1 to vector _v2, so that _v2.Normalize() == this * _v1.Normalize() holds.

Parameters
[in]_v1The first vector.
[in]_v2The second vector.

Implementation inspired by http://stackoverflow.com/a/11741520/1076564

References Quaternion< T >::Normalize(), and Matrix6< T >::Set().

◆ SetFromAxisAngle() [1/2]

template<typename T >
void SetFromAxisAngle ( const Vector3< T > &  _axis,
_a 
)
inline

Set the quaternion from an axis and angle.

Parameters
[in]_axisAxis
[in]_aAngle in radians

References Quaternion< T >::SetFromAxisAngle().

◆ SetFromAxisAngle() [2/2]

template<typename T >
void SetFromAxisAngle ( _ax,
_ay,
_az,
_aa 
)
inline

Set the quaternion from an axis and angle.

Parameters
[in]_axX axis
[in]_ayY axis
[in]_azZ axis
[in]_aaAngle in radians

References Quaternion< T >::Normalize().

Referenced by Quaternion< T >::Quaternion(), Quaternion< T >::Scale(), and Quaternion< T >::SetFromAxisAngle().

◆ SetFromEuler() [1/2]

template<typename T >
void SetFromEuler ( const Vector3< T > &  _vec)
inline

Set the quaternion from Euler angles. The order of operations is roll, pitch, yaw around a fixed body frame axis (the original frame of the object before rotation is applied). Roll is a rotation about x, pitch is about y, yaw is about z.

Parameters
[in]_vecEuler angles in radians.

References Quaternion< T >::SetFromEuler().

Referenced by Quaternion< T >::Quaternion(), Quaternion< T >::Quaternion(), and Quaternion< T >::SetFromEuler().

◆ SetFromEuler() [2/2]

template<typename T >
void SetFromEuler ( _roll,
_pitch,
_yaw 
)
inline

Set the quaternion from Euler angles.

Parameters
[in]_rollRoll angle in radians.
[in]_pitchPitch angle in radians.
[in]_yawYaw angle in radians.

References Quaternion< T >::Normalize().

◆ SetFromMatrix()

template<typename T >
void SetFromMatrix ( const Matrix3< T > &  _mat)
inline

Set from a rotation matrix.

Parameters
[in]_matRotation matrix (must be orthogonal, the function doesn't check it).

Implementation inspired by http://www.euclideanspace.com/maths/geometry/rotations/ conversions/matrixToQuaternion/

Referenced by Quaternion< T >::Quaternion().

◆ SetW()

template<typename T >
void SetW ( _v)
inline

Set the w component.

Parameters
[in]_vThe new value for the w quaternion component.

◆ SetX()

template<typename T >
void SetX ( _v)
inline

Set the x component.

Parameters
[in]_vThe new value for the x quaternion component.

◆ SetY()

template<typename T >
void SetY ( _v)
inline

Set the y component.

Parameters
[in]_vThe new value for the y quaternion component.

◆ SetZ()

template<typename T >
void SetZ ( _v)
inline

Set the z component.

Parameters
[in]_vThe new value for the z quaternion component.

◆ Slerp()

template<typename T >
static Quaternion< T > Slerp ( _fT,
const Quaternion< T > &  _rkP,
const Quaternion< T > &  _rkQ,
bool  _shortestPath = false 
)
inlinestatic

Spherical linear interpolation between 2 quaternions, given the ends and an interpolation parameter between 0 and 1.

Parameters
[in]_fTThe interpolation parameter.
[in]_rkPThe beginning quaternion.
[in]_rkQThe end quaternion.
[in]_shortestPathWhen true, the rotation may be inverted to get to minimize rotation.
Returns
The result of the linear interpolation.

Referenced by OnePoleQuaternion::Process(), and Quaternion< T >::Squad().

◆ Squad()

template<typename T >
static Quaternion< T > Squad ( _fT,
const Quaternion< T > &  _rkP,
const Quaternion< T > &  _rkA,
const Quaternion< T > &  _rkB,
const Quaternion< T > &  _rkQ,
bool  _shortestPath = false 
)
inlinestatic

Spherical quadratic interpolation given the ends and an interpolation parameter between 0 and 1.

Parameters
[in]_fTthe interpolation parameter.
[in]_rkPThe beginning quaternion.
[in]_rkAFirst intermediate quaternion.
[in]_rkBSecond intermediate quaternion.
[in]_rkQThe end quaternion.
[in]_shortestPathWhen true, the rotation may be inverted to get to minimize rotation.
Returns
The result of the quadratic interpolation.

References Quaternion< T >::Slerp().

◆ W() [1/2]

template<typename T >
T & W ( )
inline

Get a mutable w component.

Returns
The w quaternion component.

◆ W() [2/2]

template<typename T >
T W ( ) const
inline

Get the w component.

Returns
The w quaternion component.

◆ X() [1/2]

template<typename T >
T & X ( )
inline

Get a mutable x component.

Returns
The x quaternion component.

◆ X() [2/2]

template<typename T >
T X ( ) const
inline

Get the x component.

Returns
The x quaternion component.

◆ XAxis()

template<typename T >
Vector3< T > XAxis ( ) const
inline

Return the X axis.

Returns
the X axis of the vector.

◆ Y() [1/2]

template<typename T >
T & Y ( )
inline

Get a mutable y component.

Returns
The y quaternion component.

◆ Y() [2/2]

template<typename T >
T Y ( ) const
inline

Get the y component.

Returns
The y quaternion component.

◆ Yaw()

template<typename T >
T Yaw ( ) const
inline

Get the Euler yaw angle in radians.

Returns
The yaw component.

References Quaternion< T >::Euler().

◆ YAxis()

template<typename T >
Vector3< T > YAxis ( ) const
inline

Return the Y axis.

Returns
the Y axis of the vector.

◆ Z() [1/2]

template<typename T >
T & Z ( )
inline

Get a mutable z component.

Returns
The z quaternion component.

◆ Z() [2/2]

template<typename T >
T Z ( ) const
inline

Get the z component.

Returns
The z quaternion component.

◆ ZAxis()

template<typename T >
Vector3< T > ZAxis ( ) const
inline

Return the Z axis.

Returns
the Z axis of the vector.

Member Data Documentation

◆ Identity

template<typename T >
const Quaternion< T > & Identity = detail::gQuaternionIdentity<T>
static

A Quaternion initialized to identity. This is equivalent to math::Quaternion<T>(1, 0, 0, 0)

◆ Zero

template<typename T >
const Quaternion< T > & Zero = detail::gQuaternionZero<T>
static

A Quaternion initialized to zero. This is equivalent to math::Quaternion<T>(0, 0, 0, 0)


The documentation for this class was generated from the following files: