28 :
TaskMotion(name, robot), m_constraint(name, 3, robot.
nv()) {
44 mask.size() == 3,
"The size of the mask vector needs to equal 3");
62 "The size of the Kp vector needs to equal 3");
68 "The size of the Kd vector needs to equal 3");
128 for (
int i = 0;
i < 3;
i++) {
const Matrix3x & Jcom(const Data &data) const
const Vector & position_error() const
ConstraintEquality m_constraint
int dim() const
Return the dimension of the task. should be overloaded in the child class.
void resize(unsigned int size)
RobotWrapper & m_robot
Reference on the robot model.
const math::Vector & getDerivative() const
const Vector & velocity() const
const Vector & vector() const
const ConstraintBase & compute(const double t, ConstRefVector q, ConstRefVector v, Data &data)
const Vector & getDesiredAcceleration() const
Vector getAcceleration(ConstRefVector dv) const
const ConstraintBase & getConstraint() const
TSID_DISABLE_WARNING_PUSH TSID_DISABLE_WARNING_DEPRECATED const math::Vector & getValue() const
math::ConstRefVector ConstRefVector
const Eigen::Ref< const Vector > ConstRefVector
void com(const Data &data, RefVector com_pos, RefVector com_vel, RefVector com_acc) const
TaskComEquality(const std::string &name, RobotWrapper &robot)
Vector m_v_error_masked_vec
Eigen::Matrix< Scalar, 3, Eigen::Dynamic > Matrix3x
const Vector & velocity_error() const
Wrapper for a robot based on pinocchio.
const math::Vector & getSecondDerivative() const
void setReference(const TrajectorySample &ref)
const Vector & position_ref() const
Vector m_p_error_masked_vec
virtual const Matrix & matrix() const
virtual void setMask(math::ConstRefVector mask)
virtual void setMask(math::ConstRefVector mask)
const Vector & position() const
#define PINOCCHIO_CHECK_INPUT_ARGUMENT(...)
const Vector & velocity_ref() const
void resize(const unsigned int r, const unsigned int c)
const TrajectorySample & getReference() const