src/robots/robot-wrapper.cpp
Go to the documentation of this file.
1 //
2 // Copyright (c) 2017 CNRS
3 //
4 // This file is part of tsid
5 // tsid is free software: you can redistribute it
6 // and/or modify it under the terms of the GNU Lesser General Public
7 // License as published by the Free Software Foundation, either version
8 // 3 of the License, or (at your option) any later version.
9 // tsid is distributed in the hope that it will be
10 // useful, but WITHOUT ANY WARRANTY; without even the implied warranty
11 // of MERCHANTABILITY or FITNESS FOR A PARTICULAR PURPOSE. See the GNU
12 // General Lesser Public License for more details. You should have
13 // received a copy of the GNU Lesser General Public License along with
14 // tsid If not, see
15 // <http://www.gnu.org/licenses/>.
16 //
17 
19 
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>
27 
28 using namespace pinocchio;
29 using namespace tsid::math;
30 
31 namespace tsid {
32 namespace robots {
33 
34 RobotWrapper::RobotWrapper(const std::string& filename,
35  const std::vector<std::string>&, bool verbose)
36  : m_verbose(verbose) {
39  m_na = m_model.nv;
41  m_is_fixed_base = true;
42  init();
43 }
44 
45 RobotWrapper::RobotWrapper(const std::string& filename,
46  const std::vector<std::string>&,
47  const pinocchio::JointModelVariant& rootJoint,
48  bool verbose)
49  : m_verbose(verbose) {
50  pinocchio::urdf::buildModel(filename, rootJoint, m_model, m_verbose);
52  m_na = m_model.nv - 6;
53  m_nq_actuated = m_model.nq - 7;
54  m_is_fixed_base = false;
55  init();
56 }
57 
59  : m_verbose(verbose) {
60  m_model = m;
61  m_model_filename = "";
62  m_na = m_model.nv - 6;
63  m_nq_actuated = m_model.nq - 7;
64  m_is_fixed_base = false;
65  init();
66 }
67 
69  bool verbose)
70  : m_verbose(verbose) {
71  m_model = m;
72  m_model_filename = "";
73  m_na = m_model.nv;
75  m_is_fixed_base = true;
76  switch (rootJoint) {
77  case FIXED_BASE_SYSTEM:
78  break;
80  m_na -= 6;
81  m_nq_actuated = m_model.nq - 7;
82  m_is_fixed_base = false;
83  default:
84  break;
85  }
86  init();
87 }
88 
90  m_rotor_inertias.setZero(m_na);
91  m_gear_ratios.setZero(m_na);
92  m_Md.setZero(m_na);
93  m_M.setZero(m_model.nv, m_model.nv);
94 }
95 
96 int RobotWrapper::nq() const { return m_model.nq; }
97 int RobotWrapper::nv() const { return m_model.nv; }
98 int RobotWrapper::na() const { return m_na; }
101 
102 const Model& RobotWrapper::model() const { return m_model; }
104 
106  const Vector& v) const {
107  pinocchio::computeAllTerms(m_model, data, q, v);
108  data.M.triangularView<Eigen::StrictlyLower>() =
109  data.M.transpose().triangularView<Eigen::StrictlyLower>();
110  // computeAllTerms does not compute the com acceleration, so we need to call
111  // centerOfMass Check this line, calling with zero acceleration at the last
112  // phase compute the CoM acceleration.
113  // pinocchio::centerOfMass(m_model, data, q,v,false);
115  pinocchio::centerOfMass(m_model, data, q, v, Eigen::VectorXd::Zero(nv()));
116  pinocchio::ccrba(m_model, data, q, v);
117 }
118 
121 
124  rotor_inertias.size() == m_rotor_inertias.size(),
125  "The size of the rotor_inertias vector is incorrect!");
127  updateMd();
128  return true;
129 }
130 
133  gear_ratios.size() == m_gear_ratios.size(),
134  "The size of the gear_ratios vector is incorrect!");
136  updateMd();
137  return true;
138 }
139 
141  m_Md =
142  m_gear_ratios.cwiseProduct(m_gear_ratios.cwiseProduct(m_rotor_inertias));
143 }
144 
146  RefVector com_acc) const {
147  com_pos = data.com[0];
148  com_vel = data.vcom[0];
149  com_acc = data.acom[0];
150 }
151 
152 const Vector3& RobotWrapper::com(const Data& data) const { return data.com[0]; }
153 
154 const Vector3& RobotWrapper::com_vel(const Data& data) const {
155  return data.vcom[0];
156 }
157 
158 const Vector3& RobotWrapper::com_acc(const Data& data) const {
159  return data.acom[0];
160 }
161 
162 const Matrix3x& RobotWrapper::Jcom(const Data& data) const { return data.Jcom; }
163 
165  m_M = data.M;
166  m_M.diagonal().tail(m_na) += m_Md;
167  return m_M;
168 }
169 
171  return data.nle;
172 }
173 
175  const Model::JointIndex index) const {
177  index < data.oMi.size(),
178  "The index needs to be less than the size of the oMi vector");
179  return data.oMi[index];
180 }
181 
183  const Model::JointIndex index) const {
185  index < data.v.size(),
186  "The index needs to be less than the size of the v vector");
187  return data.v[index];
188 }
189 
191  const Model::JointIndex index) const {
193  index < data.a.size(),
194  "The index needs to be less than the size of the a vector");
195  return data.a[index];
196 }
197 
199  const Model::JointIndex index,
200  Data::Matrix6x& J) const {
202  index < data.oMi.size(),
203  "The index needs to be less than the size of the oMi vector");
204  return pinocchio::getJointJacobian(m_model, data, index, pinocchio::WORLD, J);
205 }
206 
208  const Model::JointIndex index,
209  Data::Matrix6x& J) const {
211  index < data.oMi.size(),
212  "The index needs to be less than the size of the oMi vector");
213  return pinocchio::getJointJacobian(m_model, data, index, pinocchio::LOCAL, J);
214 }
215 
217  const Model::FrameIndex index) const {
219  "Frame index greater than size of frame "
220  "vector in model - frame may not exist");
221  const Frame& f = m_model.frames[index];
222  return data.oMi[f.parent].act(f.placement);
223 }
224 
226  const Model::FrameIndex index,
227  SE3& framePosition) const {
229  "Frame index greater than size of frame "
230  "vector in model - frame may not exist");
231  const Frame& f = m_model.frames[index];
232  framePosition = data.oMi[f.parent].act(f.placement);
233 }
234 
236  const Model::FrameIndex index) const {
238  "Frame index greater than size of frame "
239  "vector in model - frame may not exist");
240  const Frame& f = m_model.frames[index];
241  return f.placement.actInv(data.v[f.parent]);
242 }
243 
245  const Model::FrameIndex index,
246  Motion& frameVelocity) const {
248  "Frame index greater than size of frame "
249  "vector in model - frame may not exist");
250  const Frame& f = m_model.frames[index];
251  frameVelocity = f.placement.actInv(data.v[f.parent]);
252 }
253 
255  const Data& data, const Model::FrameIndex index) const {
256  Motion v_local, v_world;
257  SE3 oMi, oMi_rotation_only;
258  framePosition(data, index, oMi);
259  frameVelocity(data, index, v_local);
260  oMi_rotation_only.rotation(oMi.rotation());
261  v_world = oMi_rotation_only.act(v_local);
262  return v_world;
263 }
264 
266  const Model::FrameIndex index) const {
268  "Frame index greater than size of frame "
269  "vector in model - frame may not exist");
270  const Frame& f = m_model.frames[index];
271  return f.placement.actInv(data.a[f.parent]);
272 }
273 
275  const Model::FrameIndex index,
276  Motion& frameAcceleration) const {
278  "Frame index greater than size of frame "
279  "vector in model - frame may not exist");
280  const Frame& f = m_model.frames[index];
281  frameAcceleration = f.placement.actInv(data.a[f.parent]);
282 }
283 
285  const Data& data, const Model::FrameIndex index) const {
286  Motion a_local, a_world;
287  SE3 oMi, oMi_rotation_only;
288  framePosition(data, index, oMi);
289  frameAcceleration(data, index, a_local);
290  oMi_rotation_only.rotation(oMi.rotation());
291  a_world = oMi_rotation_only.act(a_local);
292  return a_world;
293 }
294 
296  const Data& data, const Model::FrameIndex index) const {
298  "Frame index greater than size of frame "
299  "vector in model - frame may not exist");
300  const Frame& f = m_model.frames[index];
301  Motion a = f.placement.actInv(data.a[f.parent]);
302  Motion v = f.placement.actInv(data.v[f.parent]);
303  a.linear() += v.angular().cross(v.linear());
304  return a;
305 }
306 
308  const Model::FrameIndex index,
309  Motion& frameAcceleration) const {
311  "Frame index greater than size of frame "
312  "vector in model - frame may not exist");
313  const Frame& f = m_model.frames[index];
314  frameAcceleration = f.placement.actInv(data.a[f.parent]);
315  Motion v = f.placement.actInv(data.v[f.parent]);
316  frameAcceleration.linear() += v.angular().cross(v.linear());
317 }
318 
320  const Data& data, const Model::FrameIndex index) const {
321  Motion a_local, a_world;
322  SE3 oMi, oMi_rotation_only;
323  framePosition(data, index, oMi);
324  frameClassicAcceleration(data, index, a_local);
325  oMi_rotation_only.rotation(oMi.rotation());
326  a_world = oMi_rotation_only.act(a_local);
327  return a_world;
328 }
329 
331  Data::Matrix6x& J) const {
333  "Frame index greater than size of frame "
334  "vector in model - frame may not exist");
335  return pinocchio::getFrameJacobian(m_model, data, index, pinocchio::WORLD, J);
336 }
337 
339  Data::Matrix6x& J) const {
341  "Frame index greater than size of frame "
342  "vector in model - frame may not exist");
343  return pinocchio::getFrameJacobian(m_model, data, index, pinocchio::LOCAL, J);
344 }
345 
347  return data.Ag;
348 }
349 
352  m_model, const_cast<Data&>(data))
353  .angular();
354 }
355 
356 void RobotWrapper::setGravity(const Motion& gravity) {
357  m_model.gravity = gravity;
358 }
359 
360 // const Vector3 & com(Data & data,const Vector & q,
361 // const bool computeSubtreeComs = true,
362 // const bool updateKinematics = true)
363 // {
364 // return pinocchio::centerOfMass(m_model, data, q, computeSubtreeComs,
365 // updateKinematics);
366 // }
367 // const Vector3 & com(Data & data, const Vector & q, const Vector & v,
368 // const bool computeSubtreeComs = true,
369 // const bool updateKinematics = true)
370 // {
371 // return pinocchio::centerOfMass(m_model, data, q, v, computeSubtreeComs,
372 // updateKinematics);
373 // }
374 
375 } // namespace robots
376 } // namespace tsid
bool verbose
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
const Model & model() const
Accessor to model.
FrameVector frames
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)
data
Definition: setup.in.py:48
ConstAngularType angular() const
const DataTpl< Scalar, Options, JointCollectionTpl >::Force & computeCentroidalMomentumTimeVariation(const ModelTpl< Scalar, Options, JointCollectionTpl > &model, DataTpl< Scalar, Options, JointCollectionTpl > &data)
Motion frameAccelerationWorldOriented(const Data &data, const Model::FrameIndex index) 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
list robots
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)
Vec3f a
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
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
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


tsid
Author(s): Andrea Del Prete, Justin Carpentier
autogenerated on Sun Jul 2 2023 02:21:51