20 #include <pinocchio/algorithm/joint-configuration.hpp> 21 #include <pinocchio/algorithm/centroidal.hpp> 30 :
TaskMotion(name, robot), m_constraint(name, 3, robot.
nv()) {
52 "The size of the Kp vector needs to equal 3");
58 "The size of the Kd vector needs to equal 3");
92 m_L = J_am.bottomRows(3) *
v;
const ConstraintBase & getConstraint() const
const Vector & dmomentum_ref() 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
void resize(unsigned int size)
RobotWrapper & m_robot
Reference on the robot model.
int dim() const
Return the dimension of the task. should be overloaded in the child class.
const math::Vector & getDerivative() const
const Vector3 & momentum() const
virtual bool setMatrix(ConstRefMatrix A)
TSID_DISABLE_WARNING_PUSH TSID_DISABLE_WARNING_DEPRECATED const math::Vector & getValue() const
ConstraintEquality m_constraint
math::ConstRefVector ConstRefVector
const Vector3 & momentum_error() const
Vector3 getdMomentum(ConstRefVector dv) const
Wrapper for a robot based on pinocchio.
void setReference(const TrajectorySample &ref)
bool setVector(ConstRefVector b)
pinocchio::Data::Matrix6x Matrix6x
virtual const Matrix & matrix() const
const Vector & momentum_ref() const
const Vector3 & getDesiredMomentumDerivative() const
#define PINOCCHIO_CHECK_INPUT_ARGUMENT(...)
const ConstraintBase & compute(const double t, ConstRefVector q, ConstRefVector v, Data &data)