task-angular-momentum-equality.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 
20 #include <pinocchio/algorithm/joint-configuration.hpp>
21 #include <pinocchio/algorithm/centroidal.hpp>
22 
23 namespace tsid {
24 namespace tasks {
25 using namespace math;
26 using namespace trajectories;
27 using namespace pinocchio;
28 
30  : TaskMotion(name, robot), m_constraint(name, 3, robot.nv()) {
31  m_Kp.setZero(3);
32  m_Kd.setZero(3);
33  m_L_error.setZero(3);
34  m_dL_error.setZero(3);
35  m_L.setZero(3);
36  m_dL.setZero(3);
37  m_dL_des.setZero(3);
38  m_ref.resize(3);
39 }
40 
41 int TaskAMEquality::dim() const {
42  // return self._mask.sum ()
43  return 3;
44 }
45 
46 const Vector3& TaskAMEquality::Kp() { return m_Kp; }
47 
48 const Vector3& TaskAMEquality::Kd() { return m_Kd; }
49 
51  PINOCCHIO_CHECK_INPUT_ARGUMENT(Kp.size() == 3,
52  "The size of the Kp vector needs to equal 3");
53  m_Kp = Kp;
54 }
55 
57  PINOCCHIO_CHECK_INPUT_ARGUMENT(Kd.size() == 3,
58  "The size of the Kd vector needs to equal 3");
59  m_Kd = Kd;
60 }
61 
63 
65 
67  return m_dL_des;
68 }
69 
71  return m_constraint.matrix() * dv - m_drift;
72 }
73 
75 
76 const Vector3& TaskAMEquality::momentum() const { return m_L; }
77 const Vector& TaskAMEquality::momentum_ref() const { return m_ref.getValue(); }
78 
80  return m_ref.getDerivative();
81 }
82 
84  return m_constraint;
85 }
86 
89  // Compute errors
90  // Get momentum jacobian
91  const Matrix6x& J_am = m_robot.momentumJacobian(data);
92  m_L = J_am.bottomRows(3) * v;
94 
95  m_dL_des = -m_Kp.cwiseProduct(m_L_error) + m_ref.getDerivative();
96 
97 #ifndef NDEBUG
98 // std::cout<<m_name<<" errors: "<<m_L_error.norm()<<" "
99 // <<m_dL_error.norm()<<std::endl;
100 #endif
101 
103  m_constraint.setMatrix(J_am.bottomRows(3));
105 
106  return m_constraint;
107 }
108 
109 } // namespace tasks
110 } // namespace tsid
const ConstraintBase & getConstraint() const
const TrajectorySample & getReference() const
Vector3 angularMomentumTimeVariation(const Data &data) const
TaskAMEquality(const std::string &name, RobotWrapper &robot)
const Data::Matrix6x & momentumJacobian(const Data &data) const
RobotWrapper & m_robot
Reference on the robot model.
Definition: task-base.hpp:64
int dim() const
Return the dimension of the task. should be overloaded in the child class.
data
Definition: setup.in.py:48
virtual bool setMatrix(ConstRefMatrix A)
TSID_DISABLE_WARNING_PUSH TSID_DISABLE_WARNING_DEPRECATED const math::Vector & getValue() const
math::ConstRefVector ConstRefVector
Definition: task-base.hpp:39
int nv
Definition: ex_4_conf.py:25
Vector3 getdMomentum(ConstRefVector dv) const
Wrapper for a robot based on pinocchio.
void setReference(const TrajectorySample &ref)
virtual const Matrix & matrix() const
const Vector3 & getDesiredMomentumDerivative() const
#define PINOCCHIO_CHECK_INPUT_ARGUMENT(...)
const ConstraintBase & compute(const double t, ConstRefVector q, ConstRefVector v, Data &data)


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