6 #include "pinocchio/algorithm/compute-all-terms.hpp" 19 data.
M.triangularView<Eigen::StrictlyLower>()
20 = data.
M.transpose().triangularView<Eigen::StrictlyLower>();
27 "Compute all the terms M, non linear effects, center of mass quantities, centroidal quantities and Jacobians in" 28 "in the same loop and store the results in data.\n" 29 "This algorithm is equivalent to calling:\n" 30 "\t- forwardKinematics\n" 32 "\t- nonLinearEffects\n" 33 "\t- computeJointJacobians\n" 35 "\t- jacobianCenterOfMass\n" 37 "\t- computeKineticEnergy\n" 38 "\t- computePotentialEnergy\n" 39 "\t- computeGeneralizedGravity\n" 41 "\tmodel: model of the kinematic tree\n" 42 "\tdata: data related to the model\n" 43 "\tq: the joint configuration vector (size model.nq)\n" 44 "\tv: the joint velocity vector (size model.nv)\n" void computeAllTerms(const ModelTpl< Scalar, Options, JointCollectionTpl > &model, DataTpl< Scalar, Options, JointCollectionTpl > &data, const Eigen::MatrixBase< ConfigVectorType > &q, const Eigen::MatrixBase< TangentVectorType > &v)
Computes efficiently all the terms needed for dynamic simulation. It is equivalent to the call at the...
JointCollectionTpl const Eigen::MatrixBase< ConfigVectorType > & q
MatrixXs M
The joint space inertia matrix (a square matrix of dim model.nv).
static void computeAllTerms_proxy(const Model &model, Data &data, const Eigen::VectorXd &q, const Eigen::VectorXd &v)
Main pinocchio namespace.
Eigen::Matrix< Scalar, Eigen::Dynamic, 1 > VectorXd
JointCollectionTpl & model