|  | 
| typedef AngleAxis< Scalar > | AngleAxisType | 
|  | 
| typedef Base::AngleAxisType | AngleAxisType | 
|  | 
| typedef Matrix< Scalar, 4, 1 > | Coefficients | 
|  | 
| typedef internal::traits< Quaternion >::Coefficients | Coefficients | 
|  | 
| typedef Matrix< Scalar, 3, 3 > | Matrix3 | 
|  | 
| typedef _Scalar | Scalar | 
|  | 
| typedef _Scalar | Scalar | 
|  | 
| typedef Matrix< Scalar, 3, 1 > | Vector3 | 
|  | 
| enum |  | 
|  | 
| typedef AngleAxis< Scalar > | AngleAxisType | 
|  | 
| typedef internal::traits< Quaternion< _Scalar, _Options > >::Coefficients | Coefficients | 
|  | 
| typedef Matrix< Scalar, 3, 3 > | Matrix3 | 
|  | 
| typedef NumTraits< Scalar >::Real | RealScalar | 
|  | 
| typedef internal::traits< Quaternion< _Scalar, _Options > >::Scalar | Scalar | 
|  | 
| typedef Matrix< Scalar, 3, 1 > | Vector3 | 
|  | 
| enum |  | 
|  | 
| enum |  | 
|  | 
| typedef Matrix< Scalar, Dim, Dim > | RotationMatrixType | 
|  | 
| typedef Matrix< Scalar, Dim, Dim > | RotationMatrixType | 
|  | 
| typedef ei_traits< Quaternion< _Scalar, _Options > >::Scalar | Scalar | 
|  | 
| typedef internal::traits< Quaternion< _Scalar, _Options > >::Scalar | Scalar | 
|  | 
| typedef Matrix< Scalar, Dim, 1 > | VectorType | 
|  | 
| enum |  | 
|  | 
| enum |  | 
|  | 
| typedef Matrix< Scalar, Dim, Dim > | RotationMatrixType | 
|  | 
| typedef Matrix< Scalar, Dim, Dim > | RotationMatrixType | 
|  | 
| typedef ei_traits< Quaternion< _Scalar > >::Scalar | Scalar | 
|  | 
| typedef internal::traits< Quaternion< _Scalar > >::Scalar | Scalar | 
|  | 
| typedef Matrix< Scalar, Dim, 1 > | VectorType | 
|  | 
|  | 
| Scalar | angularDistance (const Quaternion &other) const | 
|  | 
| template<typename NewScalarType > | 
| internal::cast_return_type< Quaternion, Quaternion< NewScalarType > >::type | cast () const | 
|  | 
| const Coefficients & | coeffs () const | 
|  | 
| Coefficients & | coeffs () | 
|  | 
| Coefficients & | coeffs () | 
|  | 
| const Coefficients & | coeffs () const | 
|  | 
| Quaternion | conjugate (void) const | 
|  | 
| Scalar | eigen2_dot (const Quaternion &other) const | 
|  | 
| template<typename Derived1 , typename Derived2 > | 
| Quaternion< Scalar, Options > | FromTwoVectors (const MatrixBase< Derived1 > &a, const MatrixBase< Derived2 > &b) | 
|  | 
| Quaternion | inverse (void) const | 
|  | 
| bool | isApprox (const Quaternion &other, typename NumTraits< Scalar >::Real prec=precision< Scalar >()) const | 
|  | 
| Scalar | norm () const | 
|  | 
| void | normalize () | 
|  | 
| Quaternion | normalized () const | 
|  | 
| Quaternion | operator* (const Quaternion &q) const | 
|  | 
| template<typename Derived > | 
| Vector3 | operator* (const MatrixBase< Derived > &vec) const | 
|  | 
| Quaternion & | operator*= (const Quaternion &q) | 
|  | 
| Quaternion & | operator= (const Quaternion &other) | 
|  | 
| Quaternion & | operator= (const AngleAxisType &aa) | 
|  | 
| template<typename Derived > | 
| Quaternion & | operator= (const MatrixBase< Derived > &m) | 
|  | 
| template<typename Derived > | 
| Quaternion< Scalar > & | operator= (const MatrixBase< Derived > &xpr) | 
|  | 
|  | Quaternion () | 
|  | 
|  | Quaternion (Scalar w, Scalar x, Scalar y, Scalar z) | 
|  | 
|  | Quaternion (const Quaternion &other) | 
|  | 
|  | Quaternion (const AngleAxisType &aa) | 
|  | 
| template<typename Derived > | 
|  | Quaternion (const MatrixBase< Derived > &other) | 
|  | 
| template<typename OtherScalarType > | 
|  | Quaternion (const Quaternion< OtherScalarType > &other) | 
|  | 
|  | Quaternion () | 
|  | 
|  | Quaternion (const Scalar &w, const Scalar &x, const Scalar &y, const Scalar &z) | 
|  | 
|  | Quaternion (const Scalar *data) | 
|  | 
| template<class Derived > | 
| EIGEN_STRONG_INLINE | Quaternion (const QuaternionBase< Derived > &other) | 
|  | 
|  | Quaternion (const AngleAxisType &aa) | 
|  | 
| template<typename Derived > | 
|  | Quaternion (const MatrixBase< Derived > &other) | 
|  | 
| template<typename OtherScalar , int OtherOptions> | 
|  | Quaternion (const Quaternion< OtherScalar, OtherOptions > &other) | 
|  | 
| template<typename Derived1 , typename Derived2 > | 
| Quaternion & | setFromTwoVectors (const MatrixBase< Derived1 > &a, const MatrixBase< Derived2 > &b) | 
|  | 
| template<typename Derived1 , typename Derived2 > | 
| Quaternion< Scalar > & | setFromTwoVectors (const MatrixBase< Derived1 > &a, const MatrixBase< Derived2 > &b) | 
|  | 
| Quaternion & | setIdentity () | 
|  | 
| Quaternion | slerp (Scalar t, const Quaternion &other) const | 
|  | 
| Scalar | squaredNorm () const | 
|  | 
| Matrix3 | toRotationMatrix (void) const | 
|  | 
| const Block< const Coefficients, 3, 1 > | vec () const | 
|  | 
| Block< Coefficients, 3, 1 > | vec () | 
|  | 
| Scalar | w () const | 
|  | 
| Scalar & | w () | 
|  | 
| Scalar | x () const | 
|  | 
| Scalar & | x () | 
|  | 
| Scalar | y () const | 
|  | 
| Scalar & | y () | 
|  | 
| Scalar | z () const | 
|  | 
| Scalar & | z () | 
|  | 
| EIGEN_STRONG_INLINE Vector3 | _transformVector (Vector3 v) const | 
|  | 
| Scalar | angularDistance (const QuaternionBase< OtherDerived > &other) const | 
|  | 
| internal::cast_return_type< Quaternion< _Scalar, _Options >, Quaternion< NewScalarType > >::type | cast () const | 
|  | 
| const internal::traits< Quaternion< _Scalar, _Options > >::Coefficients & | coeffs () const | 
|  | 
| internal::traits< Quaternion< _Scalar, _Options > >::Coefficients & | coeffs () | 
|  | 
| Quaternion< Scalar > | conjugate () const | 
|  | 
| Scalar | dot (const QuaternionBase< OtherDerived > &other) const | 
|  | 
| Quaternion< Scalar > | inverse () const | 
|  | 
| bool | isApprox (const QuaternionBase< OtherDerived > &other, const RealScalar &prec=NumTraits< Scalar >::dummy_precision()) const | 
|  | 
| Scalar | norm () const | 
|  | 
| void | normalize () | 
|  | 
| Quaternion< Scalar > | normalized () const | 
|  | 
| EIGEN_STRONG_INLINE Quaternion< Scalar > | operator* (const QuaternionBase< OtherDerived > &q) const | 
|  | 
| EIGEN_STRONG_INLINE Quaternion< _Scalar, _Options > & | operator*= (const QuaternionBase< OtherDerived > &q) | 
|  | 
| EIGEN_STRONG_INLINE QuaternionBase< Quaternion< _Scalar, _Options > > & | operator= (const QuaternionBase< Quaternion< _Scalar, _Options > > &other) | 
|  | 
| EIGEN_STRONG_INLINE Quaternion< _Scalar, _Options > & | operator= (const QuaternionBase< OtherDerived > &other) | 
|  | 
| Quaternion< _Scalar, _Options > & | operator= (const AngleAxisType &aa) | 
|  | 
| Quaternion< _Scalar, _Options > & | operator= (const MatrixBase< OtherDerived > &m) | 
|  | 
| Quaternion< _Scalar, _Options > & | setFromTwoVectors (const MatrixBase< Derived1 > &a, const MatrixBase< Derived2 > &b) | 
|  | 
| QuaternionBase & | setIdentity () | 
|  | 
| Quaternion< Scalar > | slerp (const Scalar &t, const QuaternionBase< OtherDerived > &other) const | 
|  | 
| Scalar | squaredNorm () const | 
|  | 
| Matrix3 | toRotationMatrix () const | 
|  | 
| const VectorBlock< const Coefficients, 3 > | vec () const | 
|  | 
| VectorBlock< Coefficients, 3 > | vec () | 
|  | 
| Scalar | w () const | 
|  | 
| Scalar & | w () | 
|  | 
| Scalar | x () const | 
|  | 
| Scalar & | x () | 
|  | 
| Scalar | y () const | 
|  | 
| Scalar & | y () | 
|  | 
| Scalar | z () const | 
|  | 
| Scalar & | z () | 
|  | 
| VectorType | _transformVector (const OtherVectorType &v) const | 
|  | 
| const Quaternion< _Scalar, _Options > & | derived () const | 
|  | 
| Quaternion< _Scalar, _Options > & | derived () | 
|  | 
| const Quaternion< _Scalar, _Options > & | derived () const | 
|  | 
| Quaternion< _Scalar, _Options > & | derived () | 
|  | 
| Quaternion< _Scalar, _Options > | inverse () const | 
|  | 
| Quaternion< _Scalar, _Options > | inverse () const | 
|  | 
| RotationMatrixType | matrix () const | 
|  | 
| Transform< Scalar, Dim > | operator* (const Translation< Scalar, Dim > &t) const | 
|  | 
| RotationMatrixType | operator* (const Scaling< Scalar, Dim > &s) const | 
|  | 
| Transform< Scalar, Dim > | operator* (const Transform< Scalar, Dim > &t) const | 
|  | 
| Transform< Scalar, Dim, Isometry > | operator* (const Translation< Scalar, Dim > &t) const | 
|  | 
| RotationMatrixType | operator* (const UniformScaling< Scalar > &s) const | 
|  | 
| EIGEN_STRONG_INLINE internal::rotation_base_generic_product_selector< Quaternion< _Scalar, _Options >, OtherDerived, OtherDerived::IsVectorAtCompileTime >::ReturnType | operator* (const EigenBase< OtherDerived > &e) const | 
|  | 
| Transform< Scalar, Dim, Mode > | operator* (const Transform< Scalar, Dim, Mode, Options > &t) const | 
|  | 
| RotationMatrixType | toRotationMatrix () const | 
|  | 
| RotationMatrixType | toRotationMatrix () const | 
|  | 
| VectorType | _transformVector (const OtherVectorType &v) const | 
|  | 
| const Quaternion< _Scalar > & | derived () const | 
|  | 
| Quaternion< _Scalar > & | derived () | 
|  | 
| const Quaternion< _Scalar > & | derived () const | 
|  | 
| Quaternion< _Scalar > & | derived () | 
|  | 
| Quaternion< _Scalar > | inverse () const | 
|  | 
| Quaternion< _Scalar > | inverse () const | 
|  | 
| RotationMatrixType | matrix () const | 
|  | 
| Transform< Scalar, Dim > | operator* (const Translation< Scalar, Dim > &t) const | 
|  | 
| RotationMatrixType | operator* (const Scaling< Scalar, Dim > &s) const | 
|  | 
| Transform< Scalar, Dim > | operator* (const Transform< Scalar, Dim > &t) const | 
|  | 
| Transform< Scalar, Dim, Isometry > | operator* (const Translation< Scalar, Dim > &t) const | 
|  | 
| RotationMatrixType | operator* (const UniformScaling< Scalar > &s) const | 
|  | 
| EIGEN_STRONG_INLINE internal::rotation_base_generic_product_selector< Quaternion< _Scalar >, OtherDerived, OtherDerived::IsVectorAtCompileTime >::ReturnType | operator* (const EigenBase< OtherDerived > &e) const | 
|  | 
| Transform< Scalar, Dim, Mode > | operator* (const Transform< Scalar, Dim, Mode, Options > &t) const | 
|  | 
| RotationMatrixType | toRotationMatrix () const | 
|  | 
| RotationMatrixType | toRotationMatrix () const | 
|  | 
template<typename _Scalar>
class Eigen::Quaternion< _Scalar >
The quaternion class used to represent 3D orientations and rotations. 
- Parameters
- 
  
    | _Scalar | the scalar type, i.e., the type of the coefficients |  
 
This class represents a quaternion  that is a convenient representation of orientations and rotations of objects in three dimensions. Compared to other representations like Euler angles or 3x3 matrices, quatertions offer the following advantages:
 that is a convenient representation of orientations and rotations of objects in three dimensions. Compared to other representations like Euler angles or 3x3 matrices, quatertions offer the following advantages: 
- compact storage (4 scalars) 
- efficient to compose (28 flops), 
- stable spherical interpolation
The following two typedefs are provided for convenience: 
- Quaternionffor- float
- Quaterniondfor- double
- See also
- class AngleAxis, class Transform
- Template Parameters
- 
  
    | _Scalar | the scalar type, i.e., the type of the coefficients |  | _Options | controls the memory alignement of the coeffecients. Can be # AutoAlign or # DontAlign. Default is AutoAlign. |  
 
This class represents a quaternion  that is a convenient representation of orientations and rotations of objects in three dimensions. Compared to other representations like Euler angles or 3x3 matrices, quatertions offer the following advantages:
 that is a convenient representation of orientations and rotations of objects in three dimensions. Compared to other representations like Euler angles or 3x3 matrices, quatertions offer the following advantages: 
- compact storage (4 scalars) 
- efficient to compose (28 flops), 
- stable spherical interpolation
The following two typedefs are provided for convenience: 
- Quaternionffor- float
- Quaterniondfor- double
- See also
- class AngleAxis, class Transform 
Definition at line 47 of file Eigen2Support/Geometry/Quaternion.h.