#include <fwd.hpp>
Public Types | |
typedef InertiaTpl< Scalar, Options > | Inertia |
typedef JointCollectionTpl< Scalar, Options > | JointCollection |
typedef JointCompositeTpl< _Scalar, _Options, JointCollectionTpl > | JointDerived |
typedef JointModelTpl< Scalar, Options, JointCollectionTpl > | JointModelVariant |
typedef MotionTpl< Scalar, Options > | Motion |
typedef SE3Tpl< Scalar, Options > | SE3 |
Public Member Functions | |
template<typename JointModel > | |
JointModelDerived & | addJoint (const JointModelBase< JointModel > &jmodel, const SE3 &placement=SE3::Identity()) |
Add a joint to the vector of joints. More... | |
template<typename TangentVectorType > | |
void | calc (JointDataDerived &data, const Blank blank, const Eigen::MatrixBase< TangentVectorType > &vs) const |
template<typename ConfigVectorType > | |
void | calc (JointDataDerived &data, const Eigen::MatrixBase< ConfigVectorType > &qs) const |
template<typename ConfigVectorType , typename TangentVectorType > | |
void | calc (JointDataDerived &data, const Eigen::MatrixBase< ConfigVectorType > &qs, const Eigen::MatrixBase< TangentVectorType > &vs) const |
template<typename VectorLike , typename Matrix6Like > | |
void | calc_aba (JointDataDerived &data, const Eigen::MatrixBase< VectorLike > &armature, const Eigen::MatrixBase< Matrix6Like > &I, const bool update_I) const |
template<typename NewScalar > | |
JointModelCompositeTpl< NewScalar, Options, JointCollectionTpl > | cast () const |
JointDataDerived | createData () const |
void | disp (std::ostream &os) const |
const std::vector< bool > | hasConfigurationLimit () const |
const std::vector< bool > | hasConfigurationLimitInTangent () const |
bool | isEqual (const JointModelCompositeTpl &other) const |
template<typename D > | |
SizeDepType< NV >::template ColsReturn< D >::ConstType | jointCols (const Eigen::MatrixBase< D > &A) const |
template<typename D > | |
SizeDepType< NV >::template ColsReturn< D >::Type | jointCols (Eigen::MatrixBase< D > &A) const |
template<typename D > | |
SizeDepType< Eigen::Dynamic >::template ColsReturn< D >::ConstType | jointCols_impl (const Eigen::MatrixBase< D > &A) const |
template<typename D > | |
SizeDepType< Eigen::Dynamic >::template ColsReturn< D >::Type | jointCols_impl (Eigen::MatrixBase< D > &A) const |
template<typename D > | |
SizeDepType< NQ >::template SegmentReturn< D >::ConstType | jointConfigSelector (const Eigen::MatrixBase< D > &a) const |
template<typename D > | |
SizeDepType< NQ >::template SegmentReturn< D >::Type | jointConfigSelector (Eigen::MatrixBase< D > &a) const |
template<typename D > | |
SizeDepType< Eigen::Dynamic >::template SegmentReturn< D >::ConstType | jointConfigSelector_impl (const Eigen::MatrixBase< D > &a) const |
template<typename D > | |
SizeDepType< Eigen::Dynamic >::template SegmentReturn< D >::Type | jointConfigSelector_impl (Eigen::MatrixBase< D > &a) const |
template<typename D > | |
SizeDepType< NV >::template ColsReturn< D >::ConstType | jointExtendedModelCols (const Eigen::MatrixBase< D > &A) const |
template<typename D > | |
SizeDepType< NV >::template ColsReturn< D >::Type | jointExtendedModelCols (Eigen::MatrixBase< D > &A) const |
template<typename D > | |
SizeDepType< Eigen::Dynamic >::template ColsReturn< D >::ConstType | jointExtendedModelCols_impl (const Eigen::MatrixBase< D > &A) const |
template<typename D > | |
SizeDepType< Eigen::Dynamic >::template ColsReturn< D >::Type | jointExtendedModelCols_impl (Eigen::MatrixBase< D > &A) const |
template<typename D > | |
SizeDepType< NQ >::template SegmentReturn< D >::ConstType | JointMappedConfigSelector (const Eigen::MatrixBase< D > &a) const |
template<typename D > | |
SizeDepType< NQ >::template SegmentReturn< D >::Type | JointMappedConfigSelector (Eigen::MatrixBase< D > &a) const |
template<typename D > | |
SizeDepType< Eigen::Dynamic >::template SegmentReturn< D >::ConstType | JointMappedConfigSelector_impl (const Eigen::MatrixBase< D > &a) const |
template<typename D > | |
SizeDepType< Eigen::Dynamic >::template SegmentReturn< D >::Type | JointMappedConfigSelector_impl (Eigen::MatrixBase< D > &a) const |
template<typename D > | |
SizeDepType< NV >::template SegmentReturn< D >::ConstType | JointMappedVelocitySelector (const Eigen::MatrixBase< D > &a) const |
template<typename D > | |
SizeDepType< NV >::template SegmentReturn< D >::Type | JointMappedVelocitySelector (Eigen::MatrixBase< D > &a) const |
template<typename D > | |
SizeDepType< Eigen::Dynamic >::template SegmentReturn< D >::ConstType | JointMappedVelocitySelector_impl (const Eigen::MatrixBase< D > &a) const |
template<typename D > | |
SizeDepType< Eigen::Dynamic >::template SegmentReturn< D >::Type | JointMappedVelocitySelector_impl (Eigen::MatrixBase< D > &a) const |
JointModelCompositeTpl () | |
Default contructor. More... | |
template<typename JointModel > | |
JointModelCompositeTpl (const JointModelBase< JointModel > &jmodel, const SE3 &placement=SE3::Identity()) | |
Constructor with one joint. More... | |
JointModelCompositeTpl (const JointModelCompositeTpl &other) | |
Copy constructor. More... | |
JointModelCompositeTpl (const size_t size) | |
Default contructor with a defined size. More... | |
template<typename D > | |
SizeDepType< NV >::template SegmentReturn< D >::ConstType | jointVelocitySelector (const Eigen::MatrixBase< D > &a) const |
template<typename D > | |
SizeDepType< NV >::template SegmentReturn< D >::Type | jointVelocitySelector (Eigen::MatrixBase< D > &a) const |
template<typename D > | |
SizeDepType< Eigen::Dynamic >::template SegmentReturn< D >::ConstType | jointVelocitySelector_impl (const Eigen::MatrixBase< D > &a) const |
template<typename D > | |
SizeDepType< Eigen::Dynamic >::template SegmentReturn< D >::Type | jointVelocitySelector_impl (Eigen::MatrixBase< D > &a) const |
int | nq_impl () const |
int | nv_impl () const |
int | nvExtended_impl () const |
JointModelCompositeTpl & | operator= (const JointModelCompositeTpl &other) |
typedef | PINOCCHIO_ALIGNED_STD_VECTOR (JointModelVariant) JointModelVector |
PINOCCHIO_ALIGNED_STD_VECTOR (SE3) jointPlacements | |
Vector of joint placements. Those placements correspond to the origin of the joint relatively to their parent. More... | |
PINOCCHIO_JOINT_TYPEDEF_TEMPLATE (JointDerived) | |
void | setIndexes_impl (JointIndex id, int q, int v, int vExtended) |
Update the indexes of subjoints in the stack. More... | |
std::string | shortname () const |
Static Public Member Functions | |
static std::string | classname () |
Public Attributes | |
EIGEN_MAKE_ALIGNED_OPERATOR_NEW typedef JointModelBase< JointModelCompositeTpl > | Base |
JointModelVector | joints |
Vector of joints contained in the joint composite. More... | |
int | njoints |
Number of joints contained in the JointModelComposite. More... | |
Protected Member Functions | |
void | updateJointIndexes () |
Update the indexes of the joints contained in the composition according to the position of the joint composite. More... | |
Protected Attributes | |
std::vector< int > | m_idx_q |
Keep information of both the dimension and the position of the joints in the composition. More... | |
std::vector< int > | m_idx_v |
Index in the tangent vector. More... | |
std::vector< int > | m_idx_vExtended |
Index in the jacobian matrix. More... | |
int | m_nq |
Dimensions of the config and tangent space of the composite joint. More... | |
std::vector< int > | m_nqs |
Dimension of the segment in the config vector. More... | |
int | m_nv |
int | m_nvExtended |
std::vector< int > | m_nvExtendeds |
Dimension of the segment in the jacobian matrix. More... | |
std::vector< int > | m_nvs |
Dimension of the segment in the tangent vector. More... | |
Friends | |
template<typename , int , template< typename S, int O > class, typename , typename > | |
struct | JointCompositeCalcFirstOrderStep |
template<typename , int , template< typename S, int O > class, typename > | |
struct | JointCompositeCalcZeroOrderStep |
template<typename , int , template< typename, int > class> | |
struct | JointModelCompositeTpl |
struct | Serialize< JointModelCompositeTpl > |
Definition at line 141 of file multibody/joint/fwd.hpp.
typedef InertiaTpl<Scalar, Options> pinocchio::JointModelCompositeTpl< _Scalar, _Options, JointCollectionTpl >::Inertia |
Definition at line 187 of file joint-composite.hpp.
typedef JointCollectionTpl<Scalar, Options> pinocchio::JointModelCompositeTpl< _Scalar, _Options, JointCollectionTpl >::JointCollection |
Definition at line 182 of file joint-composite.hpp.
typedef JointCompositeTpl<_Scalar, _Options, JointCollectionTpl> pinocchio::JointModelCompositeTpl< _Scalar, _Options, JointCollectionTpl >::JointDerived |
Definition at line 179 of file joint-composite.hpp.
typedef JointModelTpl<Scalar, Options, JointCollectionTpl> pinocchio::JointModelCompositeTpl< _Scalar, _Options, JointCollectionTpl >::JointModelVariant |
Definition at line 183 of file joint-composite.hpp.
typedef MotionTpl<Scalar, Options> pinocchio::JointModelCompositeTpl< _Scalar, _Options, JointCollectionTpl >::Motion |
Definition at line 186 of file joint-composite.hpp.
typedef SE3Tpl<Scalar, Options> pinocchio::JointModelCompositeTpl< _Scalar, _Options, JointCollectionTpl >::SE3 |
Definition at line 185 of file joint-composite.hpp.
|
inline |
Default contructor.
Definition at line 201 of file joint-composite.hpp.
|
inline |
Default contructor with a defined size.
Definition at line 212 of file joint-composite.hpp.
|
inline |
Constructor with one joint.
jmodel | Model of the first joint. |
placement | Placement of the first joint w.r.t. the joint origin. |
Definition at line 237 of file joint-composite.hpp.
|
inline |
Copy constructor.
other | JointModel to copy. |
Definition at line 259 of file joint-composite.hpp.
|
inline |
Add a joint to the vector of joints.
jmodel | Model of the joint to add. |
placement | Placement of the joint relatively to its predecessor. |
Definition at line 286 of file joint-composite.hpp.
void pinocchio::JointModelCompositeTpl< _Scalar, _Options, JointCollectionTpl >::calc | ( | JointDataDerived & | data, |
const Blank | blank, | ||
const Eigen::MatrixBase< TangentVectorType > & | vs | ||
) | const |
void pinocchio::JointModelCompositeTpl< _Scalar, _Options, JointCollectionTpl >::calc | ( | JointDataDerived & | data, |
const Eigen::MatrixBase< ConfigVectorType > & | qs | ||
) | const |
void pinocchio::JointModelCompositeTpl< _Scalar, _Options, JointCollectionTpl >::calc | ( | JointDataDerived & | data, |
const Eigen::MatrixBase< ConfigVectorType > & | qs, | ||
const Eigen::MatrixBase< TangentVectorType > & | vs | ||
) | const |
|
inline |
Definition at line 354 of file joint-composite.hpp.
|
inline |
Definition at line 440 of file joint-composite.hpp.
|
inlinestatic |
Definition at line 393 of file joint-composite.hpp.
|
inline |
Definition at line 301 of file joint-composite.hpp.
|
inline |
Definition at line 626 of file joint-composite.hpp.
|
inline |
Definition at line 310 of file joint-composite.hpp.
|
inline |
Definition at line 321 of file joint-composite.hpp.
|
inline |
Definition at line 422 of file joint-composite.hpp.
|
inline |
Definition at line 527 of file joint-composite.hpp.
|
inline |
Definition at line 538 of file joint-composite.hpp.
|
inline |
Definition at line 603 of file joint-composite.hpp.
|
inline |
Definition at line 615 of file joint-composite.hpp.
|
inline |
Definition at line 488 of file joint-composite.hpp.
|
inline |
Definition at line 494 of file joint-composite.hpp.
|
inline |
Definition at line 551 of file joint-composite.hpp.
|
inline |
Definition at line 557 of file joint-composite.hpp.
|
inline |
Definition at line 533 of file joint-composite.hpp.
|
inline |
Definition at line 544 of file joint-composite.hpp.
|
inline |
Definition at line 609 of file joint-composite.hpp.
|
inline |
Definition at line 621 of file joint-composite.hpp.
|
inline |
Definition at line 475 of file joint-composite.hpp.
|
inline |
Definition at line 481 of file joint-composite.hpp.
|
inline |
Definition at line 564 of file joint-composite.hpp.
|
inline |
Definition at line 570 of file joint-composite.hpp.
|
inline |
Definition at line 501 of file joint-composite.hpp.
|
inline |
Definition at line 507 of file joint-composite.hpp.
|
inline |
Definition at line 577 of file joint-composite.hpp.
|
inline |
Definition at line 583 of file joint-composite.hpp.
|
inline |
Definition at line 514 of file joint-composite.hpp.
|
inline |
Definition at line 520 of file joint-composite.hpp.
|
inline |
Definition at line 590 of file joint-composite.hpp.
|
inline |
Definition at line 596 of file joint-composite.hpp.
|
inline |
Definition at line 375 of file joint-composite.hpp.
|
inline |
Definition at line 371 of file joint-composite.hpp.
|
inline |
Definition at line 379 of file joint-composite.hpp.
|
inline |
Definition at line 402 of file joint-composite.hpp.
typedef pinocchio::JointModelCompositeTpl< _Scalar, _Options, JointCollectionTpl >::PINOCCHIO_ALIGNED_STD_VECTOR | ( | JointModelVariant | ) |
pinocchio::JointModelCompositeTpl< _Scalar, _Options, JointCollectionTpl >::PINOCCHIO_ALIGNED_STD_VECTOR | ( | SE3 | ) |
Vector of joint placements. Those placements correspond to the origin of the joint relatively to their parent.
pinocchio::JointModelCompositeTpl< _Scalar, _Options, JointCollectionTpl >::PINOCCHIO_JOINT_TYPEDEF_TEMPLATE | ( | JointDerived | ) |
|
inline |
Update the indexes of subjoints in the stack.
Definition at line 387 of file joint-composite.hpp.
|
inline |
Definition at line 397 of file joint-composite.hpp.
|
inlineprotected |
Update the indexes of the joints contained in the composition according to the position of the joint composite.
Definition at line 644 of file joint-composite.hpp.
|
friend |
Definition at line 339 of file joint-composite.hpp.
|
friend |
Definition at line 333 of file joint-composite.hpp.
|
friend |
Definition at line 640 of file joint-composite.hpp.
|
friend |
Definition at line 637 of file joint-composite.hpp.
EIGEN_MAKE_ALIGNED_OPERATOR_NEW typedef JointModelBase<JointModelCompositeTpl> pinocchio::JointModelCompositeTpl< _Scalar, _Options, JointCollectionTpl >::Base |
Definition at line 178 of file joint-composite.hpp.
JointModelVector pinocchio::JointModelCompositeTpl< _Scalar, _Options, JointCollectionTpl >::joints |
Vector of joints contained in the joint composite.
Definition at line 468 of file joint-composite.hpp.
|
protected |
Keep information of both the dimension and the position of the joints in the composition.
Index in the config vector
Definition at line 680 of file joint-composite.hpp.
|
protected |
Index in the tangent vector.
Definition at line 684 of file joint-composite.hpp.
|
protected |
Index in the jacobian matrix.
Definition at line 688 of file joint-composite.hpp.
|
protected |
Dimensions of the config and tangent space of the composite joint.
Definition at line 675 of file joint-composite.hpp.
|
protected |
Dimension of the segment in the config vector.
Definition at line 682 of file joint-composite.hpp.
|
protected |
Definition at line 675 of file joint-composite.hpp.
|
protected |
Definition at line 675 of file joint-composite.hpp.
|
protected |
Dimension of the segment in the jacobian matrix.
Definition at line 690 of file joint-composite.hpp.
|
protected |
Dimension of the segment in the tangent vector.
Definition at line 686 of file joint-composite.hpp.
int pinocchio::JointModelCompositeTpl< _Scalar, _Options, JointCollectionTpl >::njoints |
Number of joints contained in the JointModelComposite.
Definition at line 694 of file joint-composite.hpp.