Go to the documentation of this file.
5 #ifndef __pinocchio_algorithm_regressor_hpp__
6 #define __pinocchio_algorithm_regressor_hpp__
25 template<
typename,
int>
class JointCollectionTpl,
26 typename Matrix6xReturnType>
28 const ModelTpl<Scalar, Options, JointCollectionTpl> &
model,
29 const DataTpl<Scalar, Options, JointCollectionTpl> &
data,
32 const SE3Tpl<Scalar, Options> &
placement,
33 const Eigen::MatrixBase<Matrix6xReturnType> & kinematic_regressor);
51 template<
typename Scalar,
int Options,
template<
typename,
int>
class JointCollectionTpl>
60 ReturnType
res(ReturnType::Zero(6, (
model.njoints - 1) * 6));
77 template<
typename,
int>
class JointCollectionTpl,
78 typename Matrix6xReturnType>
80 const ModelTpl<Scalar, Options, JointCollectionTpl> &
model,
81 const DataTpl<Scalar, Options, JointCollectionTpl> &
data,
84 const Eigen::MatrixBase<Matrix6xReturnType> & kinematic_regressor);
101 template<
typename Scalar,
int Options,
template<
typename,
int>
class JointCollectionTpl>
109 ReturnType
res(ReturnType::Zero(6, (
model.njoints - 1) * 6));
126 template<
typename,
int>
class JointCollectionTpl,
127 typename Matrix6xReturnType>
129 const ModelTpl<Scalar, Options, JointCollectionTpl> &
model,
130 DataTpl<Scalar, Options, JointCollectionTpl> &
data,
133 const Eigen::MatrixBase<Matrix6xReturnType> & kinematic_regressor);
150 template<
typename Scalar,
int Options,
template<
typename,
int>
class JointCollectionTpl>
158 ReturnType
res(ReturnType::Zero(6, (
model.njoints - 1) * 6));
187 template<
typename,
int>
class JointCollectionTpl,
188 typename ConfigVectorType>
190 const ModelTpl<Scalar, Options, JointCollectionTpl> &
model,
191 DataTpl<Scalar, Options, JointCollectionTpl> &
data,
192 const Eigen::MatrixBase<ConfigVectorType> &
q);
204 template<
typename MotionVelocity,
typename MotionAcceleration,
typename OutputType>
206 const MotionDense<MotionVelocity> &
v,
207 const MotionDense<MotionAcceleration> &
a,
208 const Eigen::MatrixBase<OutputType> & regressor);
221 template<
typename MotionVelocity,
typename MotionAcceleration>
222 inline Eigen::Matrix<
227 bodyRegressor(const MotionDense<MotionVelocity> &
v, const MotionDense<MotionAcceleration> &
a);
247 template<
typename Scalar,
int Options,
template<
typename,
int>
class JointCollectionTpl>
250 const ModelTpl<Scalar, Options, JointCollectionTpl> &
model,
251 DataTpl<Scalar, Options, JointCollectionTpl> &
data,
272 template<
typename Scalar,
int Options,
template<
typename,
int>
class JointCollectionTpl>
275 const ModelTpl<Scalar, Options, JointCollectionTpl> &
model,
276 DataTpl<Scalar, Options, JointCollectionTpl> &
data,
306 template<
typename,
int>
class JointCollectionTpl,
307 typename ConfigVectorType,
308 typename TangentVectorType1,
309 typename TangentVectorType2>
312 const ModelTpl<Scalar, Options, JointCollectionTpl> &
model,
313 DataTpl<Scalar, Options, JointCollectionTpl> &
data,
314 const Eigen::MatrixBase<ConfigVectorType> &
q,
315 const Eigen::MatrixBase<TangentVectorType1> &
v,
316 const Eigen::MatrixBase<TangentVectorType2> &
a);
339 template<
typename,
int>
class JointCollectionTpl,
340 typename ConfigVectorType,
341 typename TangentVectorType>
343 computeKineticEnergyRegressor(
344 const ModelTpl<Scalar, Options, JointCollectionTpl> &
model,
345 DataTpl<Scalar, Options, JointCollectionTpl> &
data,
346 const Eigen::MatrixBase<ConfigVectorType> &
q,
347 const Eigen::MatrixBase<TangentVectorType> &
v);
368 template<
typename,
int>
class JointCollectionTpl,
369 typename ConfigVectorType>
372 const ModelTpl<Scalar, Options, JointCollectionTpl> &
model,
373 DataTpl<Scalar, Options, JointCollectionTpl> &
data,
374 const Eigen::MatrixBase<ConfigVectorType> &
q);
378 #include "pinocchio/algorithm/regressor.hxx"
380 #if PINOCCHIO_ENABLE_TEMPLATE_INSTANTIATION
381 #include "pinocchio/algorithm/regressor.txx"
382 #endif // PINOCCHIO_ENABLE_TEMPLATE_INSTANTIATION
384 #endif // ifndef __pinocchio_algorithm_regressor_hpp__
Eigen::Matrix< Scalar, Eigen::Dynamic, Eigen::Dynamic, Options > MatrixXs
ReferenceFrame
Various conventions to express the velocity of a moving frame.
DataTpl< Scalar, Options, JointCollectionTpl >::MatrixXs & computeJointTorqueRegressor(const ModelTpl< Scalar, Options, JointCollectionTpl > &model, DataTpl< Scalar, Options, JointCollectionTpl > &data, const Eigen::MatrixBase< ConfigVectorType > &q, const Eigen::MatrixBase< TangentVectorType1 > &v, const Eigen::MatrixBase< TangentVectorType2 > &a)
Computes the joint torque regressor that links the joint torque to the dynamic parameters of each lin...
DataTpl< Scalar, Options, JointCollectionTpl >::BodyRegressorType & frameBodyRegressor(const ModelTpl< Scalar, Options, JointCollectionTpl > &model, DataTpl< Scalar, Options, JointCollectionTpl > &data, FrameIndex frame_id)
Computes the regressor for the dynamic parameters of a rigid body attached to a given frame,...
const MotionDense< Motion2 > const SE3Tpl< SE3Scalar, SE3Options > & placement
Eigen::Matrix< Scalar, 3, Eigen::Dynamic, Options > Matrix3x
The 3d jacobian type (temporary)
const DataTpl< Scalar, Options, JointCollectionTpl >::RowVectorXs & computePotentialEnergyRegressor(const ModelTpl< Scalar, Options, JointCollectionTpl > &model, DataTpl< Scalar, Options, JointCollectionTpl > &data, const Eigen::MatrixBase< ConfigVectorType > &q)
Eigen::Matrix< Scalar, 3, 1, Options > Vector3
DataTpl< Scalar, Options, JointCollectionTpl >::BodyRegressorType & jointBodyRegressor(const ModelTpl< Scalar, Options, JointCollectionTpl > &model, DataTpl< Scalar, Options, JointCollectionTpl > &data, JointIndex joint_id)
Computes the regressor for the dynamic parameters of a rigid body attached to a given joint,...
void computeJointKinematicRegressor(const ModelTpl< Scalar, Options, JointCollectionTpl > &model, const DataTpl< Scalar, Options, JointCollectionTpl > &data, const JointIndex joint_id, const ReferenceFrame rf, const SE3Tpl< Scalar, Options > &placement, const Eigen::MatrixBase< Matrix6xReturnType > &kinematic_regressor)
JointCollectionTpl const Eigen::MatrixBase< ConfigVectorType > & q
JointCollectionTpl const Eigen::MatrixBase< ConfigVectorType > const Eigen::MatrixBase< TangentVectorType > & v
void computeFrameKinematicRegressor(const ModelTpl< Scalar, Options, JointCollectionTpl > &model, DataTpl< Scalar, Options, JointCollectionTpl > &data, const FrameIndex frame_id, const ReferenceFrame rf, const Eigen::MatrixBase< Matrix6xReturnType > &kinematic_regressor)
Eigen::Matrix< Scalar, 6, 10, Options > BodyRegressorType
The type of the body regressor.
void bodyRegressor(const MotionDense< MotionVelocity > &v, const MotionDense< MotionAcceleration > &a, const Eigen::MatrixBase< OutputType > ®ressor)
Computes the regressor for the dynamic parameters of a single rigid body.
DataTpl< Scalar, Options, JointCollectionTpl >::Matrix3x & computeStaticRegressor(const ModelTpl< Scalar, Options, JointCollectionTpl > &model, DataTpl< Scalar, Options, JointCollectionTpl > &data, const Eigen::MatrixBase< ConfigVectorType > &q)
Computes the static regressor that links the center of mass positions of all the links to the center ...
Eigen::Matrix< Scalar, 6, Eigen::Dynamic, Options > Matrix6x
The 6d jacobian type (temporary)
PINOCCHIO_EIGEN_PLAIN_TYPE(ConfigVectorType) integrate(const ModelTpl< Scalar
Integrate a configuration vector for the specified model for a tangent vector during one unit time.
Eigen::Matrix< Scalar, 1, Eigen::Dynamic, Options|Eigen::RowMajor > RowVectorXs
JointCollectionTpl & model
Main pinocchio namespace.
pinocchio
Author(s):
autogenerated on Fri Nov 1 2024 02:41:48