Go to the documentation of this file.
5 #ifndef __pinocchio_multibody_joint_composite_hpp__
6 #define __pinocchio_multibody_joint_composite_hpp__
19 template<
typename Scalar,
int Options,
template<
typename S,
int O>
class JointCollectionTpl>
22 template<
typename _Scalar,
int _Options,
template<
typename S,
int O>
class JointCollectionTpl>
43 typedef Eigen::Matrix<Scalar, 6, Eigen::Dynamic, Options>
U_t;
44 typedef Eigen::Matrix<Scalar, Eigen::Dynamic, Eigen::Dynamic, Options>
D_t;
45 typedef Eigen::Matrix<Scalar, 6, Eigen::Dynamic, Options>
UD_t;
53 template<
typename _Scalar,
int _Options,
template<
typename S,
int O>
class JointCollectionTpl>
60 template<
typename _Scalar,
int _Options,
template<
typename S,
int O>
class JointCollectionTpl>
67 template<
typename _Scalar,
int _Options,
template<
typename S,
int O>
class JointCollectionTpl>
69 :
public JointDataBase<JointDataCompositeTpl<_Scalar, _Options, JointCollectionTpl>>
71 EIGEN_MAKE_ALIGNED_OPERATOR_NEW
89 ,
joint_q(ConfigVector_t::Zero(0))
90 ,
joint_v(TangentVector_t::Zero(0))
92 ,
M(Transformation_t::Identity())
104 , iMlast(joint_data.
size())
105 , pjMi(joint_data.
size())
108 ,
S(Constraint_t::Zero(
nv))
109 ,
M(Transformation_t::Identity())
110 ,
v(Motion_t::Zero())
111 ,
c(Motion_t::Zero())
112 ,
U(U_t::Zero(6,
nv))
144 return std::string(
"JointDataComposite");
152 template<
typename Scalar,
int Options,
template<
typename,
int>
class JointCollectionTpl>
159 os <<
"JointDataComposite containing following models:\n";
160 for (
typename JointDataVector::const_iterator
it = jdata.
joints.begin();
170 template<
typename S,
int O>
class JointCollectionTpl>
176 template<
typename _Scalar,
int _Options,
template<
typename S,
int O>
class JointCollectionTpl>
178 :
public JointModelBase<JointModelCompositeTpl<_Scalar, _Options, JointCollectionTpl>>
180 EIGEN_MAKE_ALIGNED_OPERATOR_NEW
221 jointPlacements.reserve(
size);
234 template<
typename Jo
intModel>
257 , jointPlacements(other.jointPlacements)
276 template<
typename Jo
intModel>
294 typename JointDataDerived::JointDataVector jdata(
joints.size());
295 for (
int i = 0;
i < (int)
joints.size(); ++
i)
297 ::pinocchio::createData<Scalar, Options, JointCollectionTpl>(
joints[(
size_t)
i]);
298 return JointDataDerived(jdata,
nq(),
nv());
303 std::vector<bool>
vec;
304 for (
size_t i = 0;
i <
joints.size(); ++
i)
306 const std::vector<bool> & joint_cf_limit =
joints[
i].hasConfigurationLimit();
307 vec.insert(
vec.end(), joint_cf_limit.begin(), joint_cf_limit.end());
314 std::vector<bool>
vec;
315 for (
size_t i = 0;
i <
joints.size(); ++
i)
317 const std::vector<bool> & joint_cf_limit =
joints[
i].hasConfigurationLimitInTangent();
318 vec.insert(
vec.end(), joint_cf_limit.begin(), joint_cf_limit.end());
323 template<
typename,
int,
template<
typename S,
int O>
class,
typename>
326 template<
typename ConfigVectorType>
327 void calc(JointDataDerived &
data,
const Eigen::MatrixBase<ConfigVectorType> &
qs)
const;
329 template<
typename,
int,
template<
typename S,
int O>
class,
typename,
typename>
332 template<
typename ConfigVectorType,
typename TangentVectorType>
334 JointDataDerived &
data,
335 const Eigen::MatrixBase<ConfigVectorType> &
qs,
336 const Eigen::MatrixBase<TangentVectorType> & vs)
const;
338 template<
typename TangentVectorType>
340 JointDataDerived &
data,
342 const Eigen::MatrixBase<TangentVectorType> & vs)
const;
344 template<
typename VectorLike,
typename Matrix6Like>
346 JointDataDerived &
data,
347 const Eigen::MatrixBase<VectorLike> & armature,
348 const Eigen::MatrixBase<Matrix6Like> & I,
349 const bool update_I)
const
351 data.U.noalias() = I *
data.S.matrix();
352 data.StU.noalias() =
data.S.matrix().transpose() *
data.U;
353 data.StU.diagonal() += armature;
376 Base::setIndexes_impl(
id,
q,
v);
382 return std::string(
"JointModelComposite");
399 jointPlacements = other.jointPlacements;
420 template<
typename NewScalar>
435 res.jointPlacements.resize(jointPlacements.size());
436 for (
size_t k = 0; k < jointPlacements.size(); ++k)
438 res.joints[k] =
joints[k].template cast<NewScalar>();
439 res.jointPlacements[k] = jointPlacements[k].template cast<NewScalar>();
455 return a.segment(Base::i_q,
nq());
461 return a.segment(Base::i_q,
nq());
468 return a.segment(Base::i_v,
nv());
474 return a.segment(Base::i_v,
nv());
481 return A.middleCols(Base::i_v,
nv());
486 return A.middleCols(Base::i_v,
nv());
493 return a.segment(Base::i_q,
nq());
499 return a.segment(Base::i_q,
nq());
505 return a.segment(Base::i_v,
nv());
511 return a.segment(Base::i_v,
nv());
518 return A.middleCols(Base::i_v,
nv());
524 return A.middleCols(Base::i_v,
nv());
530 template<
typename,
int,
template<
typename,
int>
class>
545 for (
size_t i = 0;
i <
joints.size(); ++
i)
578 template<
typename Scalar,
int Options,
template<
typename,
int>
class JointCollectionTpl>
585 os <<
"JointModelComposite containing following models:\n";
586 for (
typename JointModelVector::const_iterator
it = jmodel.
joints.begin();
595 #include <boost/type_traits.hpp>
599 template<
typename Scalar,
int Options,
template<
typename S,
int O>
class JointCollectionTpl>
600 struct has_nothrow_constructor<
602 :
public integral_constant<bool, true>
606 template<
typename Scalar,
int Options,
template<
typename S,
int O>
class JointCollectionTpl>
608 :
public integral_constant<bool, true>
612 template<
typename Scalar,
int Options,
template<
typename S,
int O>
class JointCollectionTpl>
613 struct has_nothrow_constructor<
615 :
public integral_constant<bool, true>
619 template<
typename Scalar,
int Options,
template<
typename S,
int O>
class JointCollectionTpl>
621 :
public integral_constant<bool, true>
629 #include "pinocchio/multibody/joint/joint-composite.hxx"
631 #endif // ifndef __pinocchio_multibody_joint_composite_hpp__
JointDataDerived createData() const
JointDataCompositeTpl(const JointDataVector &joint_data, const int nq, const int nv)
#define PINOCCHIO_JOINT_DATA_BASE_ACCESSOR_DEFAULT_RETURN_TYPE
void setIndexes_impl(JointIndex id, int q, int v)
Update the indexes of subjoints in the stack.
JointCollectionTpl< Scalar, Options > JointCollection
SizeDepType< Eigen::Dynamic >::template SegmentReturn< D >::ConstType jointConfigSelector_impl(const Eigen::MatrixBase< D > &a) const
Eigen::Matrix< Scalar, Eigen::Dynamic, 1, Options > ConfigVector_t
int idx_q(const JointModelTpl< Scalar, Options, JointCollectionTpl > &jmodel)
Visit a JointModelTpl through JointIdxQVisitor to get the index in the full model configuration space...
JointModelCompositeTpl(const JointModelBase< JointModel > &jmodel, const SE3 &placement=SE3::Identity())
Constructor with one joint.
int idx_v(const JointModelTpl< Scalar, Options, JointCollectionTpl > &jmodel)
Visit a JointModelTpl through JointIdxVVisitor to get the index in the full model tangent space corre...
int nv(const JointModelTpl< Scalar, Options, JointCollectionTpl > &jmodel)
Visit a JointModelTpl through JointNvVisitor to get the dimension of the joint tangent space.
JointIndex id(const JointModelTpl< Scalar, Options, JointCollectionTpl > &jmodel)
Visit a JointModelTpl through JointIdVisitor to get the index of the joint in the kinematic chain.
#define PINOCCHIO_EIGEN_CONST_CAST(TYPE, OBJ)
Macro for an automatic const_cast.
int nq(const JointModelTpl< Scalar, Options, JointCollectionTpl > &jmodel)
Visit a JointModelTpl through JointNqVisitor to get the dimension of the joint configuration space.
Eigen::Matrix< Scalar, Eigen::Dynamic, Eigen::Dynamic, Options > D_t
JointModelCompositeTpl< NewScalar, Options, JointCollectionTpl > type
JointDataVector joints
Vector of joints.
friend struct JointCompositeCalcZeroOrderStep
JointModelCompositeTpl(const JointModelCompositeTpl &other)
Copy constructor.
std::vector< int > m_idx_q
Keep information of both the dimension and the position of the joints in the composition.
JointCompositeTpl< _Scalar, _Options, JointCollectionTpl > JointDerived
JointModelCompositeTpl & operator=(const JointModelCompositeTpl &other)
SizeDepType< NV >::template ColsReturn< D >::Type jointCols(Eigen::MatrixBase< D > &A) const
SizeDepType< Eigen::Dynamic >::template SegmentReturn< D >::ConstType jointVelocitySelector_impl(const Eigen::MatrixBase< D > &a) const
JointCompositeTpl< _Scalar, _Options, JointCollectionTpl > JointDerived
JointModelDerived & addJoint(const JointModelBase< JointModel > &jmodel, const SE3 &placement=SE3::Identity())
Add a joint to the vector of joints.
#define PINOCCHIO_JOINT_DATA_BASE_DEFAULT_ACCESSOR
static std::string classname()
void updateJointIndexes()
Update the indexes of the joints contained in the composition according to the position of the joint ...
SizeDepType< Eigen::Dynamic >::template ColsReturn< D >::ConstType jointCols_impl(const Eigen::MatrixBase< D > &A) const
EIGEN_MAKE_ALIGNED_OPERATOR_NEW typedef JointModelBase< JointModelCompositeTpl > Base
SizeDepType< NQ >::template SegmentReturn< D >::Type jointConfigSelector(Eigen::MatrixBase< D > &a) const
MotionTpl< Scalar, Options > Motion
SizeDepType< Eigen::Dynamic >::template SegmentReturn< D >::Type jointVelocitySelector_impl(Eigen::MatrixBase< D > &a) const
Eigen::Matrix< Scalar, 6, Eigen::Dynamic, Options > UD_t
PINOCCHIO_JOINT_DATA_TYPEDEF_TEMPLATE(JointDerived)
JointModelVector joints
Vector of joints contained in the joint composite.
friend struct JointCompositeCalcFirstOrderStep
SizeDepType< NV >::template SegmentReturn< D >::Type jointVelocitySelector(Eigen::MatrixBase< D > &a) const
const MotionDense< Motion2 > const SE3Tpl< SE3Scalar, SE3Options > & placement
JointCompositeTpl< _Scalar, _Options, JointCollectionTpl > JointDerived
InertiaTpl< Scalar, Options > Inertia
bool isEqual(const JointModelCompositeTpl &other) const
Eigen::Matrix< Scalar, Eigen::Dynamic, 1, Options > TangentVector_t
std::string shortname(const JointModelTpl< Scalar, Options, JointCollectionTpl > &jmodel)
Visit a JointModelTpl through JointShortnameVisitor to get the shortname of the derived joint model.
JointModelCompositeTpl< NewScalar, Options, JointCollectionTpl > cast() const
JointDataTpl< Scalar, Options, JointCollectionTpl > JointDataVariant
PINOCCHIO_JOINT_TYPEDEF_TEMPLATE(JointDerived)
MotionTpl< Scalar, Options > Bias_t
void setIndexes(JointModelTpl< Scalar, Options, JointCollectionTpl > &jmodel, JointIndex id, int q, int v)
Visit a JointModelTpl through JointSetIndexesVisitor to set the indexes of the joint in the kinematic...
EIGEN_MAKE_ALIGNED_OPERATOR_NEW typedef JointDataBase< JointDataCompositeTpl > Base
SizeDepType< NV >::template ColsReturn< D >::ConstType jointCols(const Eigen::MatrixBase< D > &A) const
JointDataCompositeTpl< Scalar, Options, JointCollectionTpl > JointDataDerived
int njoints
Number of joints contained in the JointModelComposite.
SizeDepType< NQ >::template SegmentReturn< D >::ConstType jointConfigSelector(const Eigen::MatrixBase< D > &a) const
std::ostream & operator<<(std::ostream &os, const FrameTpl< Scalar, Options > &f)
static std::string classname()
int m_nq
Dimensions of the config and tangent space of the composite joint.
void calc(JointDataDerived &data, const Eigen::MatrixBase< ConfigVectorType > &qs) const
std::string shortname() const
JointCollectionTpl const Eigen::MatrixBase< ConfigVectorType > & q
JointCollectionTpl const Eigen::MatrixBase< ConfigVectorType > const Eigen::MatrixBase< TangentVectorType > & v
bool comparison_eq(const LhsType &lhs_value, const RhsType &rhs_value)
std::string shortname() const
Eigen::Matrix< Scalar, 6, Eigen::Dynamic, Options > U_t
typedef PINOCCHIO_ALIGNED_STD_VECTOR(JointModelVariant) JointModelVector
JointModelTpl< Scalar, Options, JointCollectionTpl > JointModelVariant
MotionTpl< Scalar, Options > Motion_t
const std::vector< bool > hasConfigurationLimitInTangent() const
const std::vector< bool > hasConfigurationLimit() const
SizeDepType< Eigen::Dynamic >::template SegmentReturn< D >::Type jointConfigSelector_impl(Eigen::MatrixBase< D > &a) const
std::vector< int > m_nvs
Dimension of the segment in the tangent vector.
void calc_aba(JointDataDerived &data, const Eigen::MatrixBase< VectorLike > &armature, const Eigen::MatrixBase< Matrix6Like > &I, const bool update_I) const
typedef PINOCCHIO_ALIGNED_STD_VECTOR(JointDataVariant) JointDataVector
JointModelCompositeTpl< Scalar, Options, JointCollectionTpl > JointModelDerived
PINOCCHIO_JOINT_DATA_BASE_DEFAULT_ACCESSOR typedef JointCollectionTpl< Scalar, Options > JointCollection
JointModelCompositeTpl(const size_t size)
Default contructor with a defined size.
std::vector< int > m_nqs
Dimension of the segment in the config vector.
std::vector< int > m_idx_v
Index in the tangent vector.
JointModelCompositeTpl()
Default contructor.
Common traits structure to fully define base classes for CRTP.
SE3Tpl< Scalar, Options > SE3
JointCompositeTpl< _Scalar, _Options, JointCollectionTpl > JointDerived
Type of the cast of a class C templated by Scalar and Options, to a new NewScalar type....
virtual bool isEqual(const CollisionGeometry &other) const=0
JointMotionSubspaceTpl< Eigen::Dynamic, Scalar, Options > Constraint_t
SE3Tpl< Scalar, Options > Transformation_t
AABB & operator=(const AABB &other)=default
JointCollectionTpl< Scalar, Options > JointCollection
JointModelDerived & derived()
SizeDepType< Eigen::Dynamic >::template ColsReturn< D >::Type jointCols_impl(Eigen::MatrixBase< D > &A) const
SizeDepType< NV >::template SegmentReturn< D >::ConstType jointVelocitySelector(const Eigen::MatrixBase< D > &a) const
Main pinocchio namespace.
pinocchio
Author(s):
autogenerated on Fri Nov 1 2024 02:41:44