Go to the documentation of this file.
18 #ifndef __invdyn_task_joint_bounds_hpp__
19 #define __invdyn_task_joint_bounds_hpp__
29 EIGEN_MAKE_ALIGNED_OPERATOR_NEW
37 int dim()
const override;
66 #endif // ifndef __invdyn_task_joint_bounds_hpp__
ConstraintBound m_constraint
const ConstraintBase & compute(const double t, ConstRefVector q, ConstRefVector v, Data &data) override
const Vector & getAccelerationUpperBounds() const
Abstract class representing a linear equality/inequality constraint. Equality constraints are represe...
void setTimeStep(double dt)
const Vector & getAccelerationLowerBounds() const
TaskJointBounds(const std::string &name, RobotWrapper &robot, double dt)
math::ConstraintBound ConstraintBound
void setVelocityBounds(ConstRefVector lower, ConstRefVector upper)
int dim() const override
Return the dimension of the task. \info should be overloaded in the child class.
const Vector & getVelocityLowerBounds() const
const typedef Eigen::Ref< const Vector > ConstRefVector
Eigen::Matrix< Scalar, Eigen::Dynamic, 1 > Vector
const Vector & getVelocityUpperBounds() const
Wrapper for a robot based on pinocchio.
void setAccelerationBounds(ConstRefVector lower, ConstRefVector upper)
EIGEN_MAKE_ALIGNED_OPERATOR_NEW typedef math::Vector Vector
const std::string & name() const
const ConstraintBase & getConstraint() const override
Vector m_ddq_min_due_to_vel
Vector m_ddq_max_due_to_vel
math::ConstRefVector ConstRefVector
virtual void setMask(math::ConstRefVector mask) override
tsid
Author(s): Andrea Del Prete, Justin Carpentier
autogenerated on Thu Apr 3 2025 02:47:16