6 #ifndef __pinocchio_motion_base_hpp__ 7 #define __pinocchio_motion_base_hpp__ 12 template<
class Derived>
18 Derived &
derived() {
return *
static_cast<Derived*
>(
this); }
19 const Derived &
derived()
const {
return *
static_cast<const Derived*
>(
this); }
26 template<
typename V3Like>
27 void angular(
const Eigen::MatrixBase<V3Like> &
w)
28 {
derived().angular_impl(w.derived()); }
30 template<
typename V3Like>
31 void linear(
const Eigen::MatrixBase<V3Like> &
v)
32 {
derived().linear_impl(v.derived()); }
34 operator PlainReturnType()
const {
return derived().plain(); }
39 operator Vector6()
const {
return toVector(); }
64 {
return derived().isEqual_impl(other.derived()); }
68 {
return !(
derived() == other.derived()); }
76 template<
typename OtherScalar>
79 {
return derived().__mult__(alpha); }
81 template<
typename OtherScalar>
83 {
return derived().__div__(alpha); }
85 template<
typename OtherSpatialType>
87 cross(
const OtherSpatialType &
d)
const 92 bool isApprox(
const Derived & other,
const Scalar & prec = Eigen::NumTraits<Scalar>::dummy_precision())
const 93 {
return derived().isApprox_impl(other, prec);}
95 bool isZero(
const Scalar & prec = Eigen::NumTraits<Scalar>::dummy_precision())
const 96 {
return derived().isZero_impl(prec);}
98 template<
typename S2,
int O2>
101 {
return derived().se3Action_impl(m); }
103 template<
typename S2,
int O2>
106 {
return derived().se3ActionInverse_impl(m); }
108 template<
typename ForceDerived>
112 friend std::ostream & operator << (std::ostream & os, const MotionBase<Derived> &
v)
120 template<
typename MotionDerived>
130 #endif // ifndef __pinocchio_motion_base_hpp__ JointCollectionTpl const Eigen::MatrixBase< ConfigVectorType > const Eigen::MatrixBase< TangentVectorType > & v
HomogeneousMatrixType toHomogeneousMatrix() const
The homogeneous representation of the motion vector .
Derived & operator-=(const MotionBase< Derived > &v)
internal::RHSScalarMultiplication< Derived, OtherScalar >::ReturnType operator*(const OtherScalar &alpha) const
MotionTpl< Scalar, Options > motion(const JointDataTpl< Scalar, Options, JointCollectionTpl > &jdata)
Visit a JointDataTpl through JointMotionVisitor to get the joint internal motion as a dense motion...
bool operator!=(const MotionBase< M2 > &other) const
void linear(const Eigen::MatrixBase< V3Like > &v)
void disp(std::ostream &os) const
void angular(const Eigen::MatrixBase< V3Like > &w)
ConstLinearType linear() const
bool isApprox(const Derived &other, const Scalar &prec=Eigen::NumTraits< Scalar >::dummy_precision()) const
ConstAngularType angular() const
MotionAlgebraAction< OtherSpatialType, Derived >::ReturnType cross(const OtherSpatialType &d) const
PlainReturnType plain() const
bool isZero(const Scalar &prec=Eigen::NumTraits< Scalar >::dummy_precision()) const
bool operator==(const MotionBase< M2 > &other) const
Derived operator/(const OtherScalar &alpha) const
Main pinocchio namespace.
const Derived & derived() const
ToVectorConstReturnType toVector() const
ToVectorReturnType toVector()
MOTION_TYPEDEF_TPL(Derived)
Scalar dot(const ForceDense< ForceDerived > &f) const
SE3GroupAction< Derived >::ReturnType se3ActionInverse(const SE3Tpl< S2, O2 > &m) const
SE3GroupAction< Derived >::ReturnType se3Action(const SE3Tpl< S2, O2 > &m) const
Derived & operator+=(const MotionBase< Derived > &v)
Derived operator-() const
Derived operator+(const MotionBase< Derived > &v) const
ActionMatrixType toActionMatrix() const
Derived operator-(const MotionBase< Derived > &v) const
ActionMatrixType toDualActionMatrix() const