20 #include <pinocchio/algorithm/joint-configuration.hpp> 30 m_ref(robot.nq_actuated(), robot.
na()),
31 m_constraint(name, robot.
na(), robot.
nv()) {
50 "The size of the mask needs to equal " + std::to_string(
m_robot.
na()));
56 for (
unsigned int i = 0;
i < m.size();
i++)
59 m(
i) == 1.0,
"Valid mask values are either 0.0 or 1.0 received: " +
60 std::to_string(
m(
i)));
77 "The size of the Kp vector needs to equal " +
84 "The size of the Kd vector needs to equal " +
92 "The size of the reference value vector needs to equal " +
96 "The size of the reference value derivative vector needs to equal " +
100 "The size of the reference value second derivative vector needs to " TSID_DEPRECATED const Vector & mask() const
TaskJointPosture(const std::string &name, RobotWrapper &robot)
const TrajectorySample & getReference() const
const Vector & position_ref() const
const Vector & velocity_ref() const
Eigen::Matrix< Scalar, Eigen::Dynamic, Eigen::Dynamic > Matrix
RobotWrapper & m_robot
Reference on the robot model.
const ConstraintBase & compute(const double t, ConstRefVector q, ConstRefVector v, Data &data)
const math::Vector & getDerivative() const
void setReference(const TrajectorySample &ref)
virtual int nq_actuated() const
const Model & model() const
Accessor to model.
const Vector & vector() const
Eigen::Matrix< typename LieGroupCollection::Scalar, Eigen::Dynamic, 1, LieGroupCollection::Options > neutral(const LieGroupGenericTpl< LieGroupCollection > &lg)
const Vector & velocity() const
const Vector & position_error() const
virtual bool setMatrix(ConstRefMatrix A)
TSID_DISABLE_WARNING_PUSH TSID_DISABLE_WARNING_DEPRECATED const math::Vector & getValue() const
void difference(const LieGroupGenericTpl< LieGroupCollection > &lg, const Eigen::MatrixBase< ConfigL_t > &q0, const Eigen::MatrixBase< ConfigR_t > &q1, const Eigen::MatrixBase< Tangent_t > &v)
const Vector & velocity_error() const
math::ConstRefVector ConstRefVector
ConstraintEquality m_constraint
int dim() const
Return the dimension of the task. should be overloaded in the child class.
Vector getAcceleration(ConstRefVector dv) const
Wrapper for a robot based on pinocchio.
virtual void setMask(math::ConstRefVector mask)
const math::Vector & getSecondDerivative() const
const Vector & position() const
virtual const Matrix & matrix() const
const Vector & getDesiredAcceleration() const
#define PINOCCHIO_CHECK_INPUT_ARGUMENT(...)
void resize(const unsigned int r, const unsigned int c)
const ConstraintBase & getConstraint() const