Go to the documentation of this file.
10 #include <boost/python/overloads.hpp>
21 bool computeSubtreeComs =
true)
31 bool computeSubtreeComs =
true)
42 bool computeSubtreeComs =
true)
51 bool computeSubtreeComs =
true)
107 const context::Model &))&computeTotalMass<Scalar, Options, JointCollectionDefaultTpl>,
108 bp::args(
"model"),
"Compute the total mass of the model and return it.");
114 context::Data &))&computeTotalMass<Scalar, Options, JointCollectionDefaultTpl>,
115 bp::args(
"model",
"data"),
116 "Compute the total mass of the model, put it in data.mass[0] and return it.");
119 "computeSubtreeMasses",
122 context::Data &))&computeSubtreeMasses<Scalar, Options, JointCollectionDefaultTpl>,
123 bp::args(
"model",
"data"),
124 "Compute the mass of each kinematic subtree and store it in the vector data.mass.");
128 (bp::arg(
"model"), bp::arg(
"data"), bp::arg(
"q"), bp::arg(
"compute_subtree_coms") =
true),
129 "Compute the center of mass, putting the result in context::Data and return it."
130 "If compute_subtree_coms is True, the algorithm also computes the center of mass of the "
132 bp::return_value_policy<bp::return_by_value>());
136 (bp::arg(
"model"), bp::arg(
"data"), bp::arg(
"q"), bp::arg(
"v"),
137 bp::arg(
"compute_subtree_coms") =
true),
138 "Computes the center of mass position and velocity by storing the result in context::Data. "
139 "It returns the center of mass position expressed in the WORLD frame.\n"
140 "If compute_subtree_coms is True, the algorithm also computes the center of mass of the "
142 bp::return_value_policy<bp::return_by_value>());
146 (bp::arg(
"model"), bp::arg(
"data"), bp::arg(
"q"), bp::arg(
"v"), bp::arg(
"a"),
147 bp::arg(
"compute_subtree_coms") =
true),
148 "Computes the center of mass position, velocity and acceleration by storing the result in "
149 "context::Data. It returns the center of mass position expressed in the WORLD frame.\n"
150 "If compute_subtree_coms is True, the algorithm also computes the center of mass of the "
152 bp::return_value_policy<bp::return_by_value>());
156 (bp::arg(
"model"), bp::arg(
"data"), bp::arg(
"kinematic_level"),
157 bp::arg(
"compute_subtree_coms") =
true),
158 "Computes the center of mass position, velocity or acceleration of a given model according "
159 "to the current kinematic values contained in data and the requested kinematic_level.\n"
160 "If kinematic_level = POSITION, computes the CoM position, if kinematic_level = VELOCITY, "
161 "also computes the CoM velocity and if kinematic_level = ACCELERATION, it also computes "
162 "the CoM acceleration.\n"
163 "If compute_subtree_coms is True, the algorithm also computes the center of mass of the "
165 bp::return_value_policy<bp::return_by_value>());
169 (bp::arg(
"model"), bp::arg(
"data"), bp::arg(
"compute_subtree_coms") =
true),
170 "Computes the center of mass position, velocity and acceleration of a given model "
171 "according to the current kinematic values contained in data.\n"
172 "If compute_subtree_coms is True, the algorithm also computes the center of mass of "
174 bp::return_value_policy<bp::return_by_value>());
177 "jacobianCenterOfMass",
179 const Eigen::MatrixBase<VectorXs> &,
bool))
180 & jacobianCenterOfMass<Scalar, Options, JointCollectionDefaultTpl, VectorXs>,
181 (bp::arg(
"model"), bp::arg(
"data"), bp::arg(
"q"), bp::arg(
"compute_subtree_coms") =
true),
182 "Computes the Jacobian of the center of mass, puts the result in context::Data and return "
184 "If compute_subtree_coms is True, the algorithm also computes the center of mass of the "
186 bp::return_value_policy<bp::return_by_value>());
189 "jacobianCenterOfMass",
191 & jacobianCenterOfMass<Scalar, Options, JointCollectionDefaultTpl>,
192 (bp::arg(
"model"), bp::arg(
"data"), bp::arg(
"compute_subtree_coms") =
true),
193 "Computes the Jacobian of the center of mass, puts the result in context::Data and "
195 "If compute_subtree_coms is True, the algorithm also computes the center of mass of "
197 bp::return_value_policy<bp::return_by_value>());
201 bp::args(
"model",
"data",
"q",
"subtree_root_joint_id"),
202 "Computes the Jacobian of the CoM of the given subtree (subtree_root_joint_id) "
203 "expressed in the WORLD frame, according to the given joint configuration.",
208 bp::args(
"model",
"data",
"subtree_root_joint_id"),
209 "Computes the Jacobian of the CoM of the given subtree (subtree_root_joint_id) "
210 "expressed in the WORLD frame, according to the given entries in data.",
215 bp::args(
"model",
"data",
"subtree_root_joint_id"),
216 "Get the Jacobian of the CoM of the given subtree expressed in the world frame, "
217 "according to the given entries in data. It assumes that jacobianCenterOfMass has "
218 "been called first.",
traits< SE3Tpl >::Vector3 Vector3
static context::SE3::Vector3 com_0_proxy(const context::Model &model, context::Data &data, const context::VectorXs &q, bool computeSubtreeComs=true)
KinematicLevel
List of Kinematics Level supported by Pinocchio.
static context::SE3::Vector3 com_1_proxy(const context::Model &model, context::Data &data, const context::VectorXs &q, const context::VectorXs &v, bool computeSubtreeComs=true)
static const context::Data::Vector3 & com_default_proxy(const context::Model &model, context::Data &data, bool computeSubtreeComs=true)
context::VectorXs VectorXs
static context::Data::Matrix3x jacobian_subtree_com_proxy(const context::Model &model, context::Data &data, context::Model::JointIndex jointId)
pinocchio::JointIndex JointIndex
Eigen::Matrix< Scalar, 3, Eigen::Dynamic, Options > Matrix3x
The 3d jacobian type (temporary)
static context::Data::Matrix3x get_jacobian_subtree_com_proxy(const context::Model &model, context::Data &data, context::Model::JointIndex jointId)
Eigen::Matrix< Scalar, 3, 1, Options > Vector3
void getJacobianSubtreeCenterOfMass(const ModelTpl< Scalar, Options, JointCollectionTpl > &model, const DataTpl< Scalar, Options, JointCollectionTpl > &data, const JointIndex &rootSubtreeId, const Eigen::MatrixBase< Matrix3xLike > &res)
Retrieves the Jacobian of the center of mass of the given subtree according to the current value stor...
JointCollectionTpl const Eigen::MatrixBase< ConfigVectorType > & q
static const context::Data::Vector3 & com_level_proxy(const context::Model &model, context::Data &data, KinematicLevel kinematic_level, bool computeSubtreeComs=true)
static context::Data::Matrix3x jacobian_subtree_com_kinematics_proxy(const context::Model &model, context::Data &data, const context::VectorXs &q, context::Model::JointIndex jointId)
static context::SE3::Vector3 com_2_proxy(const context::Model &model, context::Data &data, const context::VectorXs &q, const context::VectorXs &v, const context::VectorXs &a, bool computeSubtreeComs=true)
void jacobianSubtreeCenterOfMass(const ModelTpl< Scalar, Options, JointCollectionTpl > &model, DataTpl< Scalar, Options, JointCollectionTpl > &data, const Eigen::MatrixBase< ConfigVectorType > &q, const JointIndex &rootSubtreeId, const Eigen::MatrixBase< Matrix3xLike > &res)
Computes the Jacobian of the center of mass of the given subtree according to a particular joint conf...
PINOCCHIO_PYTHON_SCALAR_TYPE Scalar
JointCollectionTpl & model
Main pinocchio namespace.
const DataTpl< Scalar, Options, JointCollectionTpl >::Vector3 & centerOfMass(const ModelTpl< Scalar, Options, JointCollectionTpl > &model, DataTpl< Scalar, Options, JointCollectionTpl > &data, const Eigen::MatrixBase< ConfigVectorType > &q, const bool computeSubtreeComs=true)
Computes the center of mass position of a given model according to a particular joint configuration....
pinocchio
Author(s):
autogenerated on Thu Apr 10 2025 02:42:18