joint-composite.hpp
Go to the documentation of this file.
1 //
2 // Copyright (c) 2016-2021 CNRS INRIA
3 //
4 
5 #ifndef __pinocchio_joint_composite_hpp__
6 #define __pinocchio_joint_composite_hpp__
7 
8 #include "pinocchio/multibody/joint/fwd.hpp"
9 #include "pinocchio/multibody/joint/joint-collection.hpp"
10 #include "pinocchio/multibody/joint/joint-basic-visitors.hpp"
11 #include "pinocchio/container/aligned-vector.hpp"
12 #include "pinocchio/spatial/act-on-set.hpp"
13 
14 #include "pinocchio/serialization/fwd.hpp"
15 
16 namespace pinocchio
17 {
18 
19  template<typename Scalar, int Options, template<typename S, int O> class JointCollectionTpl>
21 
22  template<typename _Scalar, int _Options, template<typename S, int O> class JointCollectionTpl>
23  struct traits< JointCompositeTpl<_Scalar,_Options,JointCollectionTpl> >
24  {
25  typedef _Scalar Scalar;
26 
27  enum {
28  Options = _Options,
29  NQ = Eigen::Dynamic,
30  NV = Eigen::Dynamic
31  };
32 
33  typedef JointCollectionTpl<Scalar,Options> JointCollection;
40 
41  // [ABA]
42  typedef Eigen::Matrix<Scalar,6,Eigen::Dynamic,Options> U_t;
43  typedef Eigen::Matrix<Scalar,Eigen::Dynamic,Eigen::Dynamic,Options> D_t;
44  typedef Eigen::Matrix<Scalar,6,Eigen::Dynamic,Options> UD_t;
45 
47 
48  typedef Eigen::Matrix<Scalar,Eigen::Dynamic,1,Options> ConfigVector_t;
49  typedef Eigen::Matrix<Scalar,Eigen::Dynamic,1,Options> TangentVector_t;
50  };
51 
52  template<typename Scalar, int Options, template<typename S, int O> class JointCollectionTpl>
53  struct traits< JointModelCompositeTpl<Scalar,Options,JointCollectionTpl> >
55 
56  template<typename Scalar, int Options, template<typename S, int O> class JointCollectionTpl>
57  struct traits< JointDataCompositeTpl<Scalar,Options,JointCollectionTpl> >
59 
60  template<typename _Scalar, int _Options, template<typename S, int O> class JointCollectionTpl>
62  : public JointDataBase< JointDataCompositeTpl<_Scalar,_Options,JointCollectionTpl> >
63  {
64  EIGEN_MAKE_ALIGNED_OPERATOR_NEW
65 
70 
71  typedef JointCollectionTpl<Scalar,Options> JointCollection;
73 
74  typedef PINOCCHIO_ALIGNED_STD_VECTOR(JointDataVariant) JointDataVector;
75 
76  // JointDataComposite() {} // can become necessary if we want a vector of JointDataComposite ?
77 
79  : joints()
80  , iMlast(0)
81  , pjMi(0)
82  , S(0)
83  , M(Transformation_t::Identity())
84  , v(Motion_t::Zero())
85  , c(Motion_t::Zero())
86  , U(6,0), Dinv(0,0), UDinv(6,0)
87  , StU(0,0)
88  {}
89 
90 
91  JointDataCompositeTpl(const JointDataVector & joint_data, const int /*nq*/, const int nv)
92  : joints(joint_data), iMlast(joint_data.size()), pjMi(joint_data.size())
93  , S(Constraint_t::Zero(nv))
94  , M(Transformation_t::Identity())
95  , v(Motion_t::Zero())
96  , c(Motion_t::Zero())
97  , U(U_t::Zero(6,nv))
98  , Dinv(D_t::Zero(nv,nv))
99  , UDinv(UD_t::Zero(6,nv))
100  , StU(D_t::Zero(nv,nv))
101  {}
102 
104  JointDataVector joints;
105 
107  PINOCCHIO_ALIGNED_STD_VECTOR(Transformation_t) iMlast;
108 
110  PINOCCHIO_ALIGNED_STD_VECTOR(Transformation_t) pjMi;
111 
112  Constraint_t S;
113  Transformation_t M;
114  Motion_t v;
115  Bias_t c;
116 
117  // // [ABA] specific data
118  U_t U;
119  D_t Dinv;
120  UD_t UDinv;
121 
122  D_t StU;
123 
124  static std::string classname() { return std::string("JointDataComposite"); }
125  std::string shortname() const { return classname(); }
126 
127  };
128 
129  template<typename Scalar, int Options, template<typename,int> class JointCollectionTpl>
130  inline std::ostream & operator <<(std::ostream & os, const JointDataCompositeTpl<Scalar,Options,JointCollectionTpl> & jdata)
131  {
133 
134  os << "JointDataComposite containing following models:\n" ;
135  for (typename JointDataVector::const_iterator it = jdata.joints.begin();
136  it != jdata.joints.end(); ++it)
137  os << " " << shortname(*it) << std::endl;
138  return os;
139  }
140 
141 
142  template<typename NewScalar, typename Scalar, int Options, template<typename S, int O> class JointCollectionTpl>
143  struct CastType< NewScalar, JointModelCompositeTpl<Scalar,Options,JointCollectionTpl> >
144  {
146  };
147 
148  template<typename _Scalar, int _Options, template<typename S, int O> class JointCollectionTpl>
150  : public JointModelBase< JointModelCompositeTpl<_Scalar,_Options,JointCollectionTpl> >
151  {
152  EIGEN_MAKE_ALIGNED_OPERATOR_NEW
153 
156  PINOCCHIO_JOINT_TYPEDEF_TEMPLATE(JointDerived);
157 
158  typedef JointCollectionTpl<Scalar,Options> JointCollection;
160  typedef JointModel JointModelVariant;
161 
165 
166  typedef PINOCCHIO_ALIGNED_STD_VECTOR(JointModel) JointModelVector;
167 
168  using Base::id;
169  using Base::idx_q;
170  using Base::idx_v;
171  using Base::setIndexes;
172  using Base::nq;
173  using Base::nv;
174 
177  : joints()
178  , jointPlacements()
179  , m_nq(0)
180  , m_nv(0)
181  , njoints(0)
182  {}
183 
185  JointModelCompositeTpl(const size_t size)
186  : joints()
187  , jointPlacements()
188  , m_nq(0)
189  , m_nv(0)
190  , njoints(0)
191  {
192  joints.reserve(size); jointPlacements.reserve(size);
193  m_idx_q.reserve(size); m_idx_v.reserve(size);
194  m_nqs.reserve(size); m_nvs.reserve(size);
195  }
196 
203  template<typename JointModel>
205  const SE3 & placement = SE3::Identity())
206  : joints(1,(JointModelVariant)jmodel.derived())
207  , jointPlacements(1,placement)
208  , m_nq(jmodel.nq())
209  , m_nv(jmodel.nv())
210  , m_idx_q(1,0), m_nqs(1,jmodel.nq())
211  , m_idx_v(1,0), m_nvs(1,jmodel.nv())
212  , njoints(1)
213  {}
214 
221  : Base(other)
222  , joints(other.joints)
223  , jointPlacements(other.jointPlacements)
224  , m_nq(other.m_nq)
225  , m_nv(other.m_nv)
226  , m_idx_q(other.m_idx_q), m_nqs(other.m_nqs)
227  , m_idx_v(other.m_idx_v), m_nvs(other.m_nvs)
228  , njoints(other.njoints)
229  {}
230 
231 
240  template<typename JointModel>
241  JointModelDerived & addJoint(const JointModelBase<JointModel> & jmodel,
242  const SE3 & placement = SE3::Identity())
243  {
244  joints.push_back((JointModelVariant)jmodel.derived());
245  jointPlacements.push_back(placement);
246 
247  m_nq += jmodel.nq(); m_nv += jmodel.nv();
248 
249  updateJointIndexes();
250  njoints++;
251 
252  return *this;
253  }
254 
255  JointDataDerived createData() const
256  {
257  typename JointDataDerived::JointDataVector jdata(joints.size());
258  for (int i = 0; i < (int)joints.size(); ++i)
259  jdata[(size_t)i] = ::pinocchio::createData<Scalar,Options,JointCollectionTpl>(joints[(size_t)i]);
260  return JointDataDerived(jdata,nq(),nv());
261  }
262 
263  template<typename, int, template<typename S, int O> class, typename>
264  friend struct JointCompositeCalcZeroOrderStep;
265 
266  template<typename ConfigVectorType>
267  void calc(JointDataDerived & data, const Eigen::MatrixBase<ConfigVectorType> & qs) const;
268 
269  template<typename, int, template<typename S, int O> class, typename, typename>
270  friend struct JointCompositeCalcFirstOrderStep;
271 
272  template<typename ConfigVectorType, typename TangentVectorType>
273  void calc(JointDataDerived & data,
274  const Eigen::MatrixBase<ConfigVectorType> & qs,
275  const Eigen::MatrixBase<TangentVectorType> & vs) const;
276 
277  template<typename Matrix6Like>
278  void calc_aba(JointDataDerived & data,
279  const Eigen::MatrixBase<Matrix6Like> & I,
280  const bool update_I) const
281  {
282  data.U.noalias() = I * data.S.matrix();
283  data.StU.noalias() = data.S.matrix().transpose() * data.U;
284 
285  // compute inverse
286 // data.Dinv.setIdentity();
287 // data.StU.llt().solveInPlace(data.Dinv);
289  data.UDinv.noalias() = data.U * data.Dinv;
290 
291  if (update_I)
292  PINOCCHIO_EIGEN_CONST_CAST(Matrix6Like,I).noalias() -= data.UDinv * data.U.transpose();
293  }
294 
295  int nv_impl() const { return m_nv; }
296  int nq_impl() const { return m_nq; }
297 
301  void setIndexes_impl(JointIndex id, int q, int v)
302  {
303  Base::setIndexes_impl(id, q, v);
304  updateJointIndexes();
305  }
306 
307  static std::string classname() { return std::string("JointModelComposite"); }
308  std::string shortname() const { return classname(); }
309 
311  {
312  Base::operator=(other);
313  m_nq = other.m_nq;
314  m_nv = other.m_nv;
315  m_idx_q = other.m_idx_q;
316  m_idx_v = other.m_idx_v;
317  m_nqs = other.m_nqs;
318  m_nvs = other.m_nvs;
319  joints = other.joints;
320  jointPlacements = other.jointPlacements;
321  njoints = other.njoints;
322 
323  return *this;
324  }
325 
326  using Base::isEqual;
327  bool isEqual(const JointModelCompositeTpl & other) const
328  {
329  std::cout << "JointModelCompositeTpl::isEqual" << std::endl;
330  return Base::isEqual(other)
331  && nq() == other.nq()
332  && nv() == other.nv()
333  && m_idx_q == other.m_idx_q
334  && m_idx_v == other.m_idx_v
335  && m_nqs == other.m_nqs
336  && m_nvs == other.m_nvs
337  && joints == other.joints
338  && jointPlacements == other.jointPlacements
339  && njoints == other.njoints;
340  }
341 
343  template<typename NewScalar>
345  {
347  ReturnType res((size_t)njoints);
348  res.setIndexes(id(),idx_q(),idx_v());
349  res.m_nq = m_nq;
350  res.m_nv = m_nv;
351  res.m_idx_q = m_idx_q;
352  res.m_idx_v = m_idx_v;
353  res.m_nqs = m_nqs;
354  res.m_nvs = m_nvs;
355  res.njoints = njoints;
356 
357  res.joints.resize(joints.size());
358  res.jointPlacements.resize(jointPlacements.size());
359  for(size_t k = 0; k < jointPlacements.size(); ++k)
360  {
361  res.joints[k] = joints[k].template cast<NewScalar>();
362  res.jointPlacements[k] = jointPlacements[k].template cast<NewScalar>();
363  }
364 
365  return res;
366  }
367 
369  JointModelVector joints;
371  PINOCCHIO_ALIGNED_STD_VECTOR(SE3) jointPlacements;
372 
373  template<typename D>
374  typename SizeDepType<NQ>::template SegmentReturn<D>::ConstType
375  jointConfigSelector(const Eigen::MatrixBase<D>& a) const { return a.segment(Base::i_q,nq()); }
376  template<typename D>
377  typename SizeDepType<NQ>::template SegmentReturn<D>::Type
378  jointConfigSelector( Eigen::MatrixBase<D>& a) const { return a.segment(Base::i_q,nq()); }
379 
380  template<typename D>
381  typename SizeDepType<NV>::template SegmentReturn<D>::ConstType
382  jointVelocitySelector(const Eigen::MatrixBase<D>& a) const { return a.segment(Base::i_v,nv()); }
383  template<typename D>
384  typename SizeDepType<NV>::template SegmentReturn<D>::Type
385  jointVelocitySelector( Eigen::MatrixBase<D>& a) const { return a.segment(Base::i_v,nv()); }
386 
387  template<typename D>
388  typename SizeDepType<NV>::template ColsReturn<D>::ConstType
389  jointCols(const Eigen::MatrixBase<D>& A) const { return A.middleCols(Base::i_v,nv()); }
390  template<typename D>
391  typename SizeDepType<NV>::template ColsReturn<D>::Type
392  jointCols(Eigen::MatrixBase<D>& A) const { return A.middleCols(Base::i_v,nv()); }
393 
394  template<typename D>
395  typename SizeDepType<Eigen::Dynamic>::template SegmentReturn<D>::ConstType
396  jointConfigSelector_impl(const Eigen::MatrixBase<D>& a) const { return a.segment(Base::i_q,nq()); }
397  template<typename D>
398  typename SizeDepType<Eigen::Dynamic>::template SegmentReturn<D>::Type
399  jointConfigSelector_impl(Eigen::MatrixBase<D>& a) const { return a.segment(Base::i_q,nq()); }
400  template<typename D>
401  typename SizeDepType<Eigen::Dynamic>::template SegmentReturn<D>::ConstType
402  jointVelocitySelector_impl(const Eigen::MatrixBase<D>& a) const { return a.segment(Base::i_v,nv()); }
403  template<typename D>
404  typename SizeDepType<Eigen::Dynamic>::template SegmentReturn<D>::Type
405  jointVelocitySelector_impl(Eigen::MatrixBase<D>& a) const { return a.segment(Base::i_v,nv()); }
406 
407  template<typename D>
408  typename SizeDepType<Eigen::Dynamic>::template ColsReturn<D>::ConstType
409  jointCols_impl(const Eigen::MatrixBase<D>& A) const { return A.middleCols(Base::i_v,nv()); }
410  template<typename D>
411  typename SizeDepType<Eigen::Dynamic>::template ColsReturn<D>::Type
412  jointCols_impl(Eigen::MatrixBase<D>& A) const { return A.middleCols(Base::i_v,nv()); }
413 
414 
415  protected:
416 
418 
419  template<typename, int, template<typename,int> class>
420  friend struct JointModelCompositeTpl;
421 
425  {
426  int idx_q = this->idx_q();
427  int idx_v = this->idx_v();
428 
429  m_idx_q.resize(joints.size());
430  m_idx_v.resize(joints.size());
431  m_nqs.resize(joints.size());
432  m_nvs.resize(joints.size());
433 
434  for(size_t i = 0; i < joints.size(); ++i)
435  {
436  JointModelVariant & joint = joints[i];
437 
438  m_idx_q[i] = idx_q; m_idx_v[i] = idx_v;
439  ::pinocchio::setIndexes(joint,i,idx_q,idx_v);
440  m_nqs[i] = ::pinocchio::nq(joint);
441  m_nvs[i] = ::pinocchio::nv(joint);
442  idx_q += m_nqs[i]; idx_v += m_nvs[i];
443  }
444  }
445 
446 
448  int m_nq, m_nv;
449 
451 
453  std::vector<int> m_idx_q;
455  std::vector<int> m_nqs;
457  std::vector<int> m_idx_v;
459  std::vector<int> m_nvs;
460 
461  public:
463  int njoints;
464  };
465 
466 
467  template<typename Scalar, int Options, template<typename,int> class JointCollectionTpl>
468  inline std::ostream & operator <<(std::ostream & os, const JointModelCompositeTpl<Scalar,Options,JointCollectionTpl> & jmodel)
469  {
471 
472  os << "JointModelComposite containing following models:\n" ;
473  for (typename JointModelVector::const_iterator it = jmodel.joints.begin();
474  it != jmodel.joints.end(); ++it)
475  os << " " << shortname(*it) << std::endl;
476 
477  return os;
478  }
479 
480 } // namespace pinocchio
481 
482 #include <boost/type_traits.hpp>
483 
484 namespace boost
485 {
486  template<typename Scalar, int Options, template<typename S, int O> class JointCollectionTpl>
487  struct has_nothrow_constructor< ::pinocchio::JointModelCompositeTpl<Scalar,Options,JointCollectionTpl> >
488  : public integral_constant<bool,true> {};
489 
490  template<typename Scalar, int Options, template<typename S, int O> class JointCollectionTpl>
491  struct has_nothrow_copy< ::pinocchio::JointModelCompositeTpl<Scalar,Options,JointCollectionTpl> >
492  : public integral_constant<bool,true> {};
493 
494  template<typename Scalar, int Options, template<typename S, int O> class JointCollectionTpl>
495  struct has_nothrow_constructor< ::pinocchio::JointDataCompositeTpl<Scalar,Options,JointCollectionTpl> >
496  : public integral_constant<bool,true> {};
497 
498  template<typename Scalar, int Options, template<typename S, int O> class JointCollectionTpl>
499  struct has_nothrow_copy< ::pinocchio::JointDataCompositeTpl<Scalar,Options,JointCollectionTpl> >
500  : public integral_constant<bool,true> {};
501 }
502 
503 /* --- Details -------------------------------------------------------------- */
504 /* --- Details -------------------------------------------------------------- */
505 /* --- Details -------------------------------------------------------------- */
506 #include "pinocchio/multibody/joint/joint-composite.hxx"
507 
508 #endif // ifndef __pinocchio_joint_composite_hpp__
JointCollectionTpl const Eigen::MatrixBase< ConfigVectorType > const Eigen::MatrixBase< TangentVectorType > & v
SizeDepType< NV >::template SegmentReturn< D >::ConstType jointVelocitySelector(const Eigen::MatrixBase< D > &a) const
c
Definition: ocp.py:61
std::vector< int > m_nvs
Dimension of the segment in the tangent vector.
int nv(const JointModelTpl< Scalar, Options, JointCollectionTpl > &jmodel)
Visit a JointModelTpl through JointNvVisitor to get the dimension of the joint tangent space...
int NQ
Definition: dpendulum.py:8
int m_nq
Dimensions of the config and tangent space of the composite joint.
typedef PINOCCHIO_ALIGNED_STD_VECTOR(JointData) JointDataVector
SizeDepType< NV >::template SegmentReturn< D >::Type jointVelocitySelector(Eigen::MatrixBase< D > &a) const
PINOCCHIO_JOINT_DATA_BASE_ACCESSOR_DEFAULT_RETURN_TYPE typedef 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...
SizeDepType< Eigen::Dynamic >::template ColsReturn< D >::ConstType jointCols_impl(const Eigen::MatrixBase< D > &A) const
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...
Eigen::Matrix< Scalar, Eigen::Dynamic, 1, Options > TangentVector_t
JointCompositeTpl< Scalar, Options, JointCollectionTpl > JointDerived
JointDataDerived createData() const
JointModelDerived & addJoint(const JointModelBase< JointModel > &jmodel, const SE3 &placement=SE3::Identity())
Add a joint to the vector of joints.
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
SizeDepType< Eigen::Dynamic >::template SegmentReturn< D >::Type jointConfigSelector_impl(Eigen::MatrixBase< D > &a) const
std::vector< int > m_idx_q
Keep information of both the dimension and the position of the joints in the composition.
InertiaTpl< Scalar, Options > Inertia
SizeDepType< NV >::template ColsReturn< D >::Type jointCols(Eigen::MatrixBase< D > &A) const
#define PINOCCHIO_JOINT_DATA_BASE_DEFAULT_ACCESSOR
std::size_t size(custom_string const &s)
JointModelCompositeTpl & operator=(const JointModelCompositeTpl &other)
bool isEqual(const JointModelCompositeTpl &other) const
JointDataVector joints
Vector of joints.
static ColsReturn< D >::ConstType middleCols(const Eigen::MatrixBase< D > &mat, typename Eigen::DenseBase< D >::Index start, typename Eigen::DenseBase< D >::Index size)
void updateJointIndexes()
Update the indexes of the joints contained in the composition according to the position of the joint ...
JointDataCompositeTpl< Scalar, Options, JointCollectionTpl > JointDataDerived
PINOCCHIO_JOINT_DATA_BASE_DEFAULT_ACCESSOR typedef JointCollectionTpl< Scalar, Options > JointCollection
SizeDepType< Eigen::Dynamic >::template SegmentReturn< D >::Type jointVelocitySelector_impl(Eigen::MatrixBase< D > &a) const
bool isEqual(const JointModelTpl< Scalar, Options, JointCollectionTpl > &jmodel_generic, const JointModelBase< JointModelDerived > &jmodel)
Visit a JointModelTpl<Scalar,...> to compare it to JointModelDerived.
JointDataCompositeTpl(const JointDataVector &joint_data, const int, const int nv)
JointCollectionTpl const Eigen::MatrixBase< ConfigVectorType > & q
#define PINOCCHIO_EIGEN_CONST_CAST(TYPE, OBJ)
Macro for an automatic const_cast.
SizeDepType< Eigen::Dynamic >::template SegmentReturn< D >::ConstType jointVelocitySelector_impl(const Eigen::MatrixBase< D > &a) const
void calc_aba(JointDataDerived &data, const Eigen::MatrixBase< Matrix6Like > &I, const bool update_I) const
SizeDepType< Eigen::Dynamic >::template ColsReturn< D >::Type jointCols_impl(Eigen::MatrixBase< D > &A) const
SE3::Scalar Scalar
Definition: conversions.cpp:13
#define PINOCCHIO_JOINT_DATA_BASE_ACCESSOR_DEFAULT_RETURN_TYPE
JointCompositeTpl< _Scalar, _Options, JointCollectionTpl > JointDerived
JointCollectionTpl< Scalar, Options > JointCollection
void setIndexes_impl(JointIndex id, int q, int v)
Update the indexes of subjoints in the stack.
std::string shortname(const JointModelTpl< Scalar, Options, JointCollectionTpl > &jmodel)
Visit a JointModelTpl through JointShortnameVisitor to get the shortname of the derived joint model...
JointDataTpl< Scalar, Options, JointCollectionTpl > JointDataVariant
static SegmentReturn< D >::ConstType segment(const Eigen::MatrixBase< D > &mat, typename Eigen::DenseBase< D >::Index start, typename Eigen::DenseBase< D >::Index size)
JointModelVector joints
Vector of joints contained in the joint composite.
#define PINOCCHIO_JOINT_DATA_TYPEDEF_TEMPLATE(Joint)
static EIGEN_STRONG_INLINE void run(const Eigen::MatrixBase< M1 > &StYS, const Eigen::MatrixBase< M2 > &Dinv)
U
Definition: ocp.py:61
JointCompositeTpl< Scalar, Options, JointCollectionTpl > JointDerived
JointModelDerived & derived()
JointModelCompositeTpl(const JointModelBase< JointModel > &jmodel, const SE3 &placement=SE3::Identity())
Constructor with one joint.
EIGEN_MAKE_ALIGNED_OPERATOR_NEW typedef JointDataBase< JointDataCompositeTpl > Base
std::vector< int > m_nqs
Dimension of the segment in the config vector.
int njoints
Number of joints contained in the JointModelComposite.
Main pinocchio namespace.
Definition: timings.cpp:30
JointCompositeTpl< _Scalar, _Options, JointCollectionTpl > JointDerived
MotionTpl< Scalar, Options > Motion
res
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...
JointModelTpl< Scalar, Options, JointCollectionTpl > JointModel
EIGEN_MAKE_ALIGNED_OPERATOR_NEW typedef JointModelBase< JointModelCompositeTpl > Base
Common traits structure to fully define base classes for CRTP.
Definition: src/fwd.hpp:44
JointModelCompositeTpl(const size_t size)
Default contructor with a defined size.
SizeDepType< NV >::template ColsReturn< D >::ConstType jointCols(const Eigen::MatrixBase< D > &A) const
JointModelCompositeTpl< Scalar, Options, JointCollectionTpl > JointModelDerived
M
JointModelCompositeTpl(const JointModelCompositeTpl &other)
Copy constructor.
SizeDepType< NQ >::template SegmentReturn< D >::Type jointConfigSelector(Eigen::MatrixBase< D > &a) const
std::vector< int > m_idx_v
Index in the tangent vector.
NV
Definition: dcrba.py:444
Type of the cast of a class C templated by Scalar and Options, to a new NewScalar type...
Definition: src/fwd.hpp:55
SizeDepType< Eigen::Dynamic >::template SegmentReturn< D >::ConstType jointConfigSelector_impl(const Eigen::MatrixBase< D > &a) const
SE3Tpl< Scalar, Options > SE3
JointModelCompositeTpl< NewScalar, Options, JointCollectionTpl > cast() const
#define PINOCCHIO_JOINT_TYPEDEF_TEMPLATE(Joint)


pinocchio
Author(s):
autogenerated on Tue Jun 1 2021 02:45:03