18 #ifndef __invdyn_inverse_dynamics_formulation_acc_force_hpp__ 19 #define __invdyn_inverse_dynamics_formulation_acc_force_hpp__ 31 EIGEN_MAKE_ALIGNED_OPERATOR_NEW
43 EIGEN_MAKE_ALIGNED_OPERATOR_NEW
63 unsigned int nVar()
const;
64 unsigned int nEq()
const;
65 unsigned int nIn()
const;
67 bool addMotionTask(TaskMotion& task,
double weight,
68 unsigned int priorityLevel,
69 double transition_duration = 0.0);
71 bool addForceTask(TaskContactForce& task,
double weight,
72 unsigned int priorityLevel,
73 double transition_duration = 0.0);
75 bool addActuationTask(TaskActuation& task,
double weight,
76 unsigned int priorityLevel,
77 double transition_duration = 0.0);
79 bool updateTaskWeight(
const std::string& task_name,
double weight);
82 double motion_weight = 1.0,
83 unsigned int motion_priority_level = 0);
85 TSID_DEPRECATED
bool addRigidContact(
ContactBase& contact);
87 bool updateRigidContactWeights(
const std::string& contact_name,
88 double force_regularization_weight,
89 double motion_weight = -1.0);
91 bool addMeasuredForce(MeasuredForceBase& measuredForce);
93 bool removeTask(
const std::string& taskName,
94 double transition_duration = 0.0);
96 bool removeRigidContact(
const std::string& contactName,
97 double transition_duration = 0.0);
99 bool removeMeasuredForce(
const std::string& measuredForceName);
101 const HQPData& computeProblemData(
double time, ConstRefVector
q,
104 const Vector& getActuatorForces(
const HQPOutput&
sol);
105 const Vector& getAccelerations(
const HQPOutput& sol);
106 const Vector& getContactForces(
const HQPOutput& sol);
107 Vector getContactForces(
const std::string&
name,
const HQPOutput& sol);
108 bool getContactForces(
const std::string& name,
const HQPOutput& sol,
112 template <
class TaskLevelPo
inter>
113 void addTask(TaskLevelPointer task,
double weight,
114 unsigned int priorityLevel);
116 void resizeHqpData();
118 bool removeFromHqpData(
const std::string& name);
120 bool decodeSolution(
const HQPOutput& sol);
148 #endif // ifndef __invdyn_inverse_dynamics_formulation_acc_force_hpp__
Base template of a Task. Each class is defined according to a constant model of a robot...
Eigen::Matrix< Scalar, Eigen::Dynamic, Eigen::Dynamic > Matrix
Eigen::Matrix< Scalar, Eigen::Dynamic, 1 > Vector
const Eigen::Ref< const Vector > ConstRefVector
Wrapper for a robot based on pinocchio.