18 #ifndef COB_TWIST_CONTROLLER_CONSTRAINT_SOLVERS_SOLVERS_STACK_OF_TASKS_SOLVER_H 19 #define COB_TWIST_CONTROLLER_CONSTRAINT_SOLVERS_SOLVERS_STACK_OF_TASKS_SOLVER_H 30 #define START_CNT 40.0 58 void processState(std::set<ConstraintBase_t>::iterator& it,
59 const Eigen::MatrixXd& projector,
60 const Eigen::MatrixXd& particular_solution,
61 double inv_sum_of_prios,
62 Eigen::VectorXd& sum_of_gradient);
70 #endif // COB_TWIST_CONTROLLER_CONSTRAINT_SOLVERS_SOLVERS_STACK_OF_TASKS_SOLVER_H
EN_ConstraintStates global_constraint_state_
Eigen::Matrix< double, 6, 1 > Vector6d_t
virtual Eigen::MatrixXd solve(const Vector6d_t &in_cart_velocities, const JointStates &joint_states)
void processState(std::set< ConstraintBase_t >::iterator &it, const Eigen::MatrixXd &projector, const Eigen::MatrixXd &particular_solution, double inv_sum_of_prios, Eigen::VectorXd &sum_of_gradient)
virtual ~StackOfTasksSolver()
double in_cart_vel_damping_
Base class for solvers, defining interface methods.
StackOfTasksSolver(const TwistControllerParams ¶ms, const LimiterParams &limiter_params, TaskStackController_t &task_stack_controller)