20 #include <pinocchio/multibody/model.hpp> 21 #include <pinocchio/parsers/urdf.hpp> 22 #include <pinocchio/algorithm/center-of-mass.hpp> 23 #include <pinocchio/algorithm/compute-all-terms.hpp> 24 #include <pinocchio/algorithm/jacobian.hpp> 25 #include <pinocchio/algorithm/frames.hpp> 26 #include <pinocchio/algorithm/centroidal.hpp> 34 RobotWrapper::RobotWrapper(
const std::string&
filename,
35 const std::vector<std::string>&,
bool verbose)
36 : m_verbose(verbose) {
46 const std::vector<std::string>&,
108 data.
M.triangularView<Eigen::StrictlyLower>() =
109 data.
M.transpose().triangularView<Eigen::StrictlyLower>();
125 "The size of the rotor_inertias vector is incorrect!");
134 "The size of the gear_ratios vector is incorrect!");
147 com_pos = data.com[0];
148 com_vel = data.vcom[0];
149 com_acc = data.acom[0];
177 index < data.oMi.size(),
178 "The index needs to be less than the size of the oMi vector");
179 return data.oMi[index];
185 index < data.v.size(),
186 "The index needs to be less than the size of the v vector");
187 return data.v[index];
193 index < data.a.size(),
194 "The index needs to be less than the size of the a vector");
195 return data.a[index];
202 index < data.oMi.size(),
203 "The index needs to be less than the size of the oMi vector");
211 index < data.oMi.size(),
212 "The index needs to be less than the size of the oMi vector");
219 "Frame index greater than size of frame " 220 "vector in model - frame may not exist");
222 return data.oMi[f.parent].act(f.placement);
229 "Frame index greater than size of frame " 230 "vector in model - frame may not exist");
232 framePosition = data.oMi[f.parent].act(f.placement);
238 "Frame index greater than size of frame " 239 "vector in model - frame may not exist");
241 return f.placement.actInv(data.v[f.parent]);
248 "Frame index greater than size of frame " 249 "vector in model - frame may not exist");
251 frameVelocity = f.placement.actInv(data.v[f.parent]);
257 SE3 oMi, oMi_rotation_only;
260 oMi_rotation_only.rotation(oMi.rotation());
261 v_world = oMi_rotation_only.act(v_local);
268 "Frame index greater than size of frame " 269 "vector in model - frame may not exist");
271 return f.placement.actInv(data.a[f.parent]);
278 "Frame index greater than size of frame " 279 "vector in model - frame may not exist");
281 frameAcceleration = f.placement.actInv(data.a[f.parent]);
287 SE3 oMi, oMi_rotation_only;
290 oMi_rotation_only.rotation(oMi.rotation());
291 a_world = oMi_rotation_only.act(a_local);
298 "Frame index greater than size of frame " 299 "vector in model - frame may not exist");
301 Motion a = f.placement.actInv(data.a[f.parent]);
302 Motion v = f.placement.actInv(data.v[f.parent]);
311 "Frame index greater than size of frame " 312 "vector in model - frame may not exist");
314 frameAcceleration = f.placement.actInv(data.a[f.parent]);
315 Motion v = f.placement.actInv(data.v[f.parent]);
322 SE3 oMi, oMi_rotation_only;
325 oMi_rotation_only.rotation(oMi.rotation());
326 a_world = oMi_rotation_only.act(a_local);
333 "Frame index greater than size of frame " 334 "vector in model - frame may not exist");
341 "Frame index greater than size of frame " 342 "vector in model - frame may not exist");
352 m_model, const_cast<Data&>(data))
const Matrix3x & Jcom(const Data &data) const
enum tsid::robots::RobotWrapper::e_RootJointType RootJointType
void computeAllTerms(const ModelTpl< Scalar, Options, JointCollectionTpl > &model, DataTpl< Scalar, Options, JointCollectionTpl > &data, const Eigen::MatrixBase< ConfigVectorType > &q, const Eigen::MatrixBase< TangentVectorType > &v)
Vector3 angularMomentumTimeVariation(const Data &data) const
const Motion & velocity(const Data &data, const Model::JointIndex index) const
Matrix m_M
diagonal part of inertia matrix due to rotor inertias
const Data::Matrix6x & momentumJacobian(const Data &data) const
virtual int nq_actuated() const
const Model & model() const
Accessor to model.
void frameJacobianWorld(Data &data, const Model::FrameIndex index, Data::Matrix6x &J) const
const Motion & acceleration(const Data &data, const Model::JointIndex index) const
Motion frameClassicAcceleration(const Data &data, const Model::FrameIndex index) const
Motion frameVelocityWorldOriented(const Data &data, const Model::FrameIndex index) const
void getJointJacobian(const ModelTpl< Scalar, Options, JointCollectionTpl > &model, const DataTpl< Scalar, Options, JointCollectionTpl > &data, const typename ModelTpl< Scalar, Options, JointCollectionTpl >::JointIndex jointId, const ReferenceFrame rf, const Eigen::MatrixBase< Matrix6Like > &J)
RobotWrapper(const std::string &filename, const std::vector< std::string > &package_dirs, bool verbose=false)
ConstLinearType linear() const
ConstAngularType angular() const
ConstAngularType angular() const
const DataTpl< Scalar, Options, JointCollectionTpl >::Force & computeCentroidalMomentumTimeVariation(const ModelTpl< Scalar, Options, JointCollectionTpl > &model, DataTpl< Scalar, Options, JointCollectionTpl > &data)
Model m_model
Robot model.
Motion frameAccelerationWorldOriented(const Data &data, const Model::FrameIndex index) const
math::RefVector RefVector
virtual bool is_fixed_base() const
const Vector3 & com_acc(const Data &data) const
const DataTpl< Scalar, Options, JointCollectionTpl >::Matrix6x & ccrba(const ModelTpl< Scalar, Options, JointCollectionTpl > &model, DataTpl< Scalar, Options, JointCollectionTpl > &data, const Eigen::MatrixBase< ConfigVectorType > &q, const Eigen::MatrixBase< TangentVectorType > &v)
Motion frameAcceleration(const Data &data, const Model::FrameIndex index) const
pinocchio::FrameIndex FrameIndex
void jacobianLocal(const Data &data, const Model::JointIndex index, Data::Matrix6x &J) const
SE3 framePosition(const Data &data, const Model::FrameIndex index) const
std::string m_model_filename
pinocchio::JointIndex JointIndex
ModelTpl< Scalar, Options, JointCollectionTpl > & buildModel(const std::string &filename, const typename ModelTpl< Scalar, Options, JointCollectionTpl >::JointModel &rootJoint, ModelTpl< Scalar, Options, JointCollectionTpl > &model, const bool verbose=false)
const Matrix & mass(const Data &data)
void com(const Data &data, RefVector com_pos, RefVector com_vel, RefVector com_acc) const
const Vector3 & com_vel(const Data &data) const
const Vector & nonLinearEffects(const Data &data) const
void frameJacobianLocal(Data &data, const Model::FrameIndex index, Data::Matrix6x &J) const
const Vector & gear_ratios() const
void updateFramePlacements(const ModelTpl< Scalar, Options, JointCollectionTpl > &model, DataTpl< Scalar, Options, JointCollectionTpl > &data)
const SE3 & position(const Data &data, const Model::JointIndex index) const
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)
void computeAllTerms(Data &data, const Vector &q, const Vector &v) const
void setGravity(const Motion &gravity)
JointCollectionDefault::JointModelVariant JointModelVariant
Motion frameVelocity(const Data &data, const Model::FrameIndex index) const
void jacobianWorld(const Data &data, const Model::JointIndex index, Data::Matrix6x &J) const
const Vector & rotor_inertias() const
void getFrameJacobian(const ModelTpl< Scalar, Options, JointCollectionTpl > &model, DataTpl< Scalar, Options, JointCollectionTpl > &data, const FrameIndex frame_id, const ReferenceFrame rf, const Eigen::MatrixBase< Matrix6xLike > &J)
Eigen::Matrix< Scalar, 6, Eigen::Dynamic, Options > Matrix6x
math::ConstRefVector ConstRefVector
#define PINOCCHIO_CHECK_INPUT_ARGUMENT(...)
Motion frameClassicAccelerationWorldOriented(const Data &data, const Model::FrameIndex index) const