10 #ifndef MOTOR_TORQUE_CONTROLLER_H 11 #define MOTOR_TORQUE_CONTROLLER_H 14 #include <boost/shared_ptr.hpp> 15 #include "../Stabilizer/TwoDofController.h" 65 double execute(
double _tau,
double _tauMax);
107 bool updateParam(
double &_param,
const double &_new_value);
131 #endif // MOTOR_TORQUE_CONTROLLER_H
void printMotorControllerVariables(void)
bool getTwoDofControllerPDModelParam(TwoDofControllerPDModel::TwoDofControllerPDModelParam &_param)
double execute(double _tau, double _tauMax)
void setupControllerCommon(std::string _jname, double _dt)
void prepareStop(MotorController &_mc)
Feedback and Feedforward Controller which use PDModel as motor model.
bool updateControllerParam(TwoDofController::TwoDofControllerParam &_param)
void updateController(double _tau, double _tauRef, MotorController &_mc)
controller_state_t getMotorControllerState(void)
bool setReferenceTorque(double _tauRef)
bool updateParam(double &_param, const double &_new_value)
void setErrorPrefix(const std::string &_error_prefix)
void setupTwoDofControllerPDModel(TwoDofControllerPDModel::TwoDofControllerPDModelParam &_param)
bool getTwoDofControllerDynamiccsModelParam(TwoDofControllerDynamicsModel::TwoDofControllerDynamicsModelParam &_param)
void setupMotorControllerTransitionMinMaxDq(double _min_transition_dq, double _max_transition_dq)
motor_model_t getMotorModelType(void)
bool updateTwoDofControllerDynamiccsModelParam(TwoDofControllerDynamicsModel::TwoDofControllerDynamicsModelParam &_param)
~MotorTorqueController(void)
bool getControllerParam(TwoDofController::TwoDofControllerParam &_param)
void setupMotorControllerControlMinMaxDq(double _min_dq, double _max_dq)
bool updateTwoDofControllerParam(TwoDofController::TwoDofControllerParam &_param)
bool updateTwoDofControllerPDModelParam(TwoDofControllerPDModel::TwoDofControllerPDModelParam &_param)
double getMotorControllerDq(void)
MotorController m_emergencyController
MotorController m_normalController
void setupTwoDofController(TwoDofController::TwoDofControllerParam &_param)
void setErrorPrefix(const std::string &_error_prefix)
void resetMotorControllerVariables(MotorController &_mc)
Feedback and Feedforward Controller which use PDModel as motor model.
std::string m_error_prefix
boost::shared_ptr< TwoDofControllerInterface > controller
void setupController(TwoDofController::TwoDofControllerParam &_param)
std::string getJointName(void)
void setupTwoDofControllerDynamicsModel(TwoDofControllerDynamicsModel::TwoDofControllerDynamicsModelParam &_param)
motor_model_t m_motor_model_type
bool getTwoDofControllerParam(TwoDofController::TwoDofControllerParam &_param)