18 #ifndef COB_TWIST_CONTROLLER_CONSTRAINT_SOLVERS_SOLVERS_CONSTRAINT_SOLVER_BASE_H 19 #define COB_TWIST_CONTROLLER_CONSTRAINT_SOLVERS_SOLVERS_CONSTRAINT_SOLVER_BASE_H 23 #include <kdl/jntarray.hpp> 24 #include <boost/shared_ptr.hpp> 32 template <
typename PINV = PInvBySVD>
104 #endif // COB_TWIST_CONTROLLER_CONSTRAINT_SOLVERS_SOLVERS_CONSTRAINT_SOLVER_BASE_H
ConstraintSolver(const TwistControllerParams ¶ms, const LimiterParams &limiter_params, TaskStackController_t &task_stack_controller)
const LimiterParams & limiter_params_
References the inv. diff. kin. solver parameters.
boost::shared_ptr< DampingBase > damping_
References the current Jacobian (matrix data only).
Eigen::Matrix< double, 6, 1 > Vector6d_t
virtual Eigen::MatrixXd solve(const Vector6d_t &in_cart_velocities, const JointStates &joint_states)=0
Matrix6Xd_t jacobian_data_
References the limiter parameters (up-to-date according to KinematicExtension).
PINV pinv_calc_
The currently set damping method.
void setConstraints(std::set< ConstraintBase_t > &constraints)
const TwistControllerParams & params_
Set of constraints.
std::set< ConstraintBase_t > constraints_
set inserts sorted (default less operator); if element has already been added it returns an iterator ...
virtual void setJacobianData(const Matrix6Xd_t &jacobian_data)
virtual ~ConstraintSolver()
Base class for solvers, defining interface methods.
Eigen::Matrix< double, 6, Eigen::Dynamic > Matrix6Xd_t
void setDamping(boost::shared_ptr< DampingBase > &damping)
TaskStackController_t & task_stack_controller_
An instance that helps solving the inverse of the Jacobian.