Go to the documentation of this file.
11 #ifndef EIGEN_QUATERNION_H
12 #define EIGEN_QUATERNION_H
22 template<
typename Other,
23 int OtherRows=Other::RowsAtCompileTime,
24 int OtherCols=Other::ColsAtCompileTime>
25 struct quaternionbase_assign_impl;
34 template<
class Derived>
35 class QuaternionBase :
public RotationBase<Derived, 3>
40 using Base::operator*;
66 EIGEN_DEVICE_FUNC
inline CoeffReturnType x()
const {
return this->derived().coeffs().coeff(0); }
68 EIGEN_DEVICE_FUNC
inline CoeffReturnType y()
const {
return this->derived().coeffs().coeff(1); }
70 EIGEN_DEVICE_FUNC
inline CoeffReturnType z()
const {
return this->derived().coeffs().coeff(2); }
72 EIGEN_DEVICE_FUNC
inline CoeffReturnType w()
const {
return this->derived().coeffs().coeff(3); }
147 template<
typename Derived1,
typename Derived2>
165 template<
class OtherDerived>
167 {
return coeffs().isApprox(other.coeffs(), prec); }
177 template<
typename NewScalarType>
183 #ifdef EIGEN_QUATERNIONBASE_PLUGIN
184 # include EIGEN_QUATERNIONBASE_PLUGIN
218 template<
typename _Scalar,
int _Options>
231 template<
typename _Scalar,
int _Options>
232 class Quaternion :
public QuaternionBase<Quaternion<_Scalar,_Options> >
241 using Base::operator*=;
271 template<
typename Derived>
275 template<
typename OtherScalar,
int OtherOptions>
277 {
m_coeffs = other.coeffs().template cast<Scalar>(); }
281 template<
typename Derived1,
typename Derived2>
289 #ifdef EIGEN_QUATERNION_PLUGIN
290 # include EIGEN_QUATERNION_PLUGIN
296 #ifndef EIGEN_PARSED_BY_DOXYGEN
300 INVALID_MATRIX_TEMPLATE_PARAMETERS)
317 template<
typename _Scalar,
int _Options>
318 struct traits<
Map<
Quaternion<_Scalar>, _Options> > : traits<Quaternion<_Scalar, (int(_Options)&Aligned)==Aligned ? AutoAlign : DontAlign> >
325 template<
typename _Scalar,
int _Options>
326 struct traits<
Map<const
Quaternion<_Scalar>, _Options> > :
traits<Quaternion<_Scalar, (int(_Options)&Aligned)==Aligned ? AutoAlign : DontAlign> >
347 template<
typename _Scalar,
int _Options>
349 :
public QuaternionBase<Map<const Quaternion<_Scalar>, _Options> >
357 using Base::operator*=;
384 template<
typename _Scalar,
int _Options>
394 using Base::operator*=;
431 template<
int Arch,
class Derived1,
class Derived2,
typename Scalar>
struct quat_product
436 a.w() *
b.w() -
a.x() *
b.x() -
a.y() *
b.y() -
a.z() *
b.z(),
437 a.w() *
b.x() +
a.x() *
b.w() +
a.y() *
b.z() -
a.z() *
b.y(),
438 a.w() *
b.y() +
a.y() *
b.w() +
a.z() *
b.x() -
a.x() *
b.z(),
439 a.w() *
b.z() +
a.z() *
b.w() +
a.x() *
b.y() -
a.y() *
b.x()
446 template <
class Derived>
447 template <
class OtherDerived>
452 YOU_MIXED_DIFFERENT_NUMERIC_TYPES__YOU_NEED_TO_USE_THE_CAST_METHOD_OF_MATRIXBASE_TO_CAST_NUMERIC_TYPES_EXPLICITLY)
458 template <
class Derived>
459 template <
class OtherDerived>
462 derived() = derived() * other.derived();
473 template <
class Derived>
482 Vector3 uv = this->vec().cross(v);
484 return v + this->w() * uv + this->vec().cross(uv);
487 template<
class Derived>
490 coeffs() = other.coeffs();
494 template<
class Derived>
495 template<
class OtherDerived>
498 coeffs() = other.coeffs();
504 template<
class Derived>
507 EIGEN_USING_STD_MATH(
cos)
508 EIGEN_USING_STD_MATH(
sin)
511 this->vec() =
sin(ha) * aa.
axis();
521 template<
class Derived>
522 template<
class MatrixDerived>
526 YOU_MIXED_DIFFERENT_NUMERIC_TYPES__YOU_NEED_TO_USE_THE_CAST_METHOD_OF_MATRIXBASE_TO_CAST_NUMERIC_TYPES_EXPLICITLY)
534 template<
class Derived>
545 const Scalar ty =
Scalar(2)*this->
y();
546 const Scalar tz =
Scalar(2)*this->z();
547 const Scalar twx = tx*this->w();
548 const Scalar twy = ty*this->w();
549 const Scalar twz = tz*this->w();
550 const Scalar txx = tx*this->
x();
551 const Scalar txy = ty*this->
x();
552 const Scalar txz = tz*this->
x();
553 const Scalar tyy = ty*this->
y();
554 const Scalar tyz = tz*this->
y();
555 const Scalar tzz = tz*this->z();
580 template<
class Derived>
581 template<
typename Derived1,
typename Derived2>
584 EIGEN_USING_STD_MATH(
sqrt)
602 Vector3 axis = svd.matrixV().col(2);
605 this->w() =
sqrt(w2);
612 this->vec() = axis * invs;
622 template<
typename Scalar,
int Options>
625 EIGEN_USING_STD_MATH(
sqrt)
626 EIGEN_USING_STD_MATH(
sin)
627 EIGEN_USING_STD_MATH(
cos)
628 const Scalar u1 = internal::random<Scalar>(0, 1),
629 u2 = internal::random<Scalar>(0, 2*
EIGEN_PI),
630 u3 = internal::random<Scalar>(0, 2*
EIGEN_PI);
647 template<
typename Scalar,
int Options>
648 template<
typename Derived1,
typename Derived2>
652 quat.setFromTwoVectors(
a,
b);
663 template <
class Derived>
667 Scalar n2 = this->squaredNorm();
679 template<
int Arch,
class Derived,
typename Scalar>
struct quat_conj
693 template <
class Derived>
705 template <
class Derived>
706 template <
class OtherDerived>
710 EIGEN_USING_STD_MATH(
atan2)
723 template <
class Derived>
724 template <
class OtherDerived>
728 EIGEN_USING_STD_MATH(
acos)
729 EIGEN_USING_STD_MATH(
sin)
748 scale0 =
sin( (
Scalar(1) - t ) * theta) / sinTheta;
749 scale1 =
sin( ( t * theta) ) / sinTheta;
751 if(d<
Scalar(0)) scale1 = -scale1;
759 template<
typename Other>
766 EIGEN_USING_STD_MATH(
sqrt)
775 q.x() = (
mat.coeff(2,1) -
mat.coeff(1,2)) * t;
776 q.y() = (
mat.coeff(0,2) -
mat.coeff(2,0)) * t;
777 q.z() = (
mat.coeff(1,0) -
mat.coeff(0,1)) * t;
782 if (
mat.coeff(1,1) >
mat.coeff(0,0))
784 if (
mat.coeff(2,2) >
mat.coeff(i,i))
790 q.coeffs().coeffRef(i) =
Scalar(0.5) * t;
792 q.w() = (
mat.coeff(k,j)-
mat.coeff(j,k))*t;
793 q.coeffs().coeffRef(j) = (
mat.coeff(j,i)+
mat.coeff(i,j))*t;
794 q.coeffs().coeffRef(k) = (
mat.coeff(k,i)+
mat.coeff(i,k))*t;
800 template<
typename Other>
814 #endif // EIGEN_QUATERNION_H
#define EIGEN_MAKE_ALIGNED_OPERATOR_NEW_IF(NeedsToAlign)
const EIGEN_DEVICE_FUNC SqrtReturnType sqrt() const
QuaternionBase< Map< Quaternion< _Scalar >, _Options > > Base
EIGEN_DEVICE_FUNC Quaternion(const Quaternion< OtherScalar, OtherOptions > &other)
internal::traits< Quaternion >::Coefficients Coefficients
const EIGEN_DEVICE_FUNC SinReturnType sin() const
EIGEN_DEVICE_FUNC Coefficients & coeffs()
static EIGEN_DEVICE_FUNC void run(QuaternionBase< Derived > &q, const Other &a_mat)
EIGEN_DEVICE_FUNC Quaternion(const MatrixBase< Derived > &other)
const AutoDiffScalar< Matrix< typename internal::traits< typename internal::remove_all< DerTypeA >::type >::Scalar, Dynamic, 1 > > atan2(const AutoDiffScalar< DerTypeA > &a, const AutoDiffScalar< DerTypeB > &b)
const EIGEN_DEVICE_FUNC Coefficients & coeffs() const
static EIGEN_DEVICE_FUNC Quaternion FromTwoVectors(const MatrixBase< Derived1 > &a, const MatrixBase< Derived2 > &b)
Map< Quaternion< float >, Aligned > QuaternionMapAlignedf
static EIGEN_DEVICE_FUNC void run(QuaternionBase< Derived > &q, const Other &vec)
EIGEN_DEVICE_FUNC Matrix3 toRotationMatrix() const
Represents a 3D rotation as a rotation angle around an arbitrary 3D axis.
const EIGEN_DEVICE_FUNC Derived & derived() const
EIGEN_DEVICE_FUNC Scalar dot(const QuaternionBase< OtherDerived > &other) const
Map< Quaternion< double >, 0 > QuaternionMapd
Coefficients::CoeffReturnType CoeffReturnType
EIGEN_DEVICE_FUNC Quaternion(const Scalar &w, const Scalar &x, const Scalar &y, const Scalar &z)
QuaternionBase< Quaternion< _Scalar, _Options > > Base
EIGEN_DEVICE_FUNC Quaternion< Scalar > inverse() const
EIGEN_DEVICE_FUNC internal::cast_return_type< Derived, Quaternion< NewScalarType > >::type cast() const
EIGEN_DEVICE_FUNC NonConstCoeffReturnType x()
EIGEN_DEVICE_FUNC Quaternion< Scalar > slerp(const Scalar &t, const QuaternionBase< OtherDerived > &other) const
EIGEN_DEVICE_FUNC Scalar angle() const
Scalar EIGEN_BLAS_FUNC() dot(int *n, RealScalar *px, int *incx, RealScalar *py, int *incy)
AngleAxis< Scalar > AngleAxisType
EIGEN_DEVICE_FUNC bool isApprox(const QuaternionBase< OtherDerived > &other, const RealScalar &prec=NumTraits< Scalar >::dummy_precision()) const
EIGEN_DEVICE_FUNC QuaternionBase & setIdentity()
EIGEN_DEVICE_FUNC CoeffReturnType y() const
const Coefficients m_coeffs
internal::conditional< bool(internal::traits< Derived >::Flags &LvalueBit), Scalar &, CoeffReturnType >::type NonConstCoeffReturnType
EIGEN_DEVICE_FUNC Quaternion()
const unsigned int LvalueBit
EIGEN_DEVICE_FUNC const Scalar & q
internal::traits< Derived >::Coefficients Coefficients
static EIGEN_DEVICE_FUNC Quaternion UnitRandom()
const EIGEN_DEVICE_FUNC Coefficients & coeffs() const
Common base class for compact rotation representations.
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE Vector3 _transformVector(const Vector3 &v) const
#define EIGEN_STRONG_INLINE
EIGEN_DEVICE_FUNC Scalar norm() const
const EIGEN_DEVICE_FUNC internal::traits< Derived >::Coefficients & coeffs() const
Quaternion< float > Quaternionf
const EIGEN_DEVICE_FUNC Coefficients & coeffs() const
EIGEN_DEVICE_FUNC CoeffReturnType z() const
Quaternion< double > Quaterniond
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE Map(Scalar *coeffs)
EIGEN_DEVICE_FUNC Scalar squaredNorm() const
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE Scalar & coeffRef(Index rowId, Index colId)
static EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE Quaternion< Scalar > run(const QuaternionBase< Derived > &q)
static EIGEN_STRONG_INLINE void _check_template_params()
Map< const Matrix< _Scalar, 4, 1 >, _Options > Coefficients
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE Map(const Scalar *coeffs)
const EIGEN_DEVICE_FUNC AcosReturnType acos() const
A matrix or vector expression mapping an existing array of data.
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE QuaternionBase< Derived > & operator=(const QuaternionBase< Derived > &other)
EIGEN_DEVICE_FUNC internal::traits< Derived >::Coefficients & coeffs()
EIGEN_DEVICE_FUNC Quaternion< Scalar > conjugate() const
EIGEN_DEVICE_FUNC Coefficients & coeffs()
static EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE Quaternion< Scalar > run(const QuaternionBase< Derived1 > &a, const QuaternionBase< Derived2 > &b)
EIGEN_DEVICE_FUNC ConjugateReturnType conjugate() const
Two-sided Jacobi SVD decomposition of a rectangular matrix.
internal::traits< Derived >::Scalar Scalar
const EIGEN_DEVICE_FUNC Vector3 & axis() const
The quaternion class used to represent 3D orientations and rotations.
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE Derived & operator*=(const QuaternionBase< OtherDerived > &q)
Matrix< Scalar, 3, 1 > Vector3
Matrix< Scalar, 3, 3 > Matrix3
#define EIGEN_STATIC_ASSERT(CONDITION, MSG)
Map< Quaternion< float >, 0 > QuaternionMapf
Quaternion< _Scalar, _Options > PlainObject
RotationBase< Derived, 3 > Base
Matrix< _Scalar, 4, 1, _Options > Coefficients
EIGEN_DEVICE_FUNC Derived & setFromTwoVectors(const MatrixBase< Derived1 > &a, const MatrixBase< Derived2 > &b)
void run(Expr &expr, Dev &dev)
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE Quaternion(const QuaternionBase< Derived > &other)
Expression of a fixed-size or dynamic-size sub-vector.
EIGEN_DEVICE_FUNC Quaternion< Scalar > normalized() const
QuaternionBase< Map< const Quaternion< _Scalar >, _Options > > Base
EIGEN_DEVICE_FUNC Scalar angularDistance(const QuaternionBase< OtherDerived > &other) const
EIGEN_DEVICE_FUNC NonConstCoeffReturnType y()
EIGEN_DEVICE_FUNC void normalize()
EIGEN_DEVICE_FUNC NonConstCoeffReturnType w()
const EIGEN_DEVICE_FUNC VectorBlock< const Coefficients, 3 > vec() const
EIGEN_DEVICE_FUNC NonConstCoeffReturnType z()
EIGEN_DEVICE_FUNC EIGEN_ALWAYS_INLINE internal::enable_if< NumTraits< T >::IsSigned||NumTraits< T >::IsComplex, typename NumTraits< T >::Real >::type abs(const T &x)
EIGEN_DEVICE_FUNC VectorBlock< Coefficients, 3 > vec()
EIGEN_DEVICE_FUNC EIGEN_ALWAYS_INLINE T maxi(const T &x, const T &y)
NumTraits< Scalar >::Real RealScalar
Base class for all dense matrices, vectors, and expressions.
EIGEN_DEVICE_FUNC CoeffReturnType w() const
internal::traits< Map >::Coefficients Coefficients
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE Quaternion< Scalar > operator*(const QuaternionBase< OtherDerived > &q) const
EIGEN_DEVICE_FUNC Quaternion(const AngleAxisType &aa)
EIGEN_DEVICE_FUNC Quaternion(const Scalar *data)
internal::traits< Map >::Coefficients Coefficients
static EIGEN_DEVICE_FUNC Quaternion< Scalar > Identity()
Base::AngleAxisType AngleAxisType
Map< Quaternion< double >, Aligned > QuaternionMapAlignedd
#define EIGEN_INHERIT_ASSIGNMENT_OPERATORS(Derived)
Base class for quaternion expressions.
Holds information about the various numeric (i.e. scalar) types allowed by Eigen.
EIGEN_DEVICE_FUNC CoeffReturnType x() const
const EIGEN_DEVICE_FUNC CosReturnType cos() const
EIGEN_DEFAULT_DENSE_INDEX_TYPE Index
The Index type as used for the API.
control_box_rst
Author(s): Christoph Rösmann
autogenerated on Wed Mar 2 2022 00:06:08