43 #include <roboteq_control/MotorStatus.h> 44 #include <roboteq_control/ControlStatus.h> 80 void initializeMotor(
bool load_from_board);
95 void resetPosition(
double position);
105 void switchController(
string type);
137 void readVector(std::vector<std::string> fields);
151 return x * 60 / (2 * M_PI);
160 return x * (2 * M_PI) / 60;
169 double to_encoder_ticks(
double x);
177 double from_encoder_ticks(
double x);
215 void read(
string data);
uint8_t loop_error_detect
ros::Publisher pub_status
roboteq_control::ControlStatus msg_control
hardware_interface::JointStateHandle joint_state_handle
uint8_t reverse_limit_triggered
hardware_interface::JointHandle joint_handle
struct roboteq::_motor_status motor_status_t
uint8_t safety_stop_active
joint_limits_interface::VelocityJointSoftLimitsInterface vel_limits_interface
ROS joint limits interface.
string getName()
getName the name of the motor
uint8_t amps_triggered_active
TFSIMD_FORCE_INLINE const tfScalar & x() const
MotorPIDConfigurator * pid_position
static double to_rpm(double x)
int getNumber()
getNumber The roboteq number
MotorParamConfigurator * parameter
void registerSensor(GPIOSensor *sensor)
registerSensor register the sensor
MotorPIDConfigurator * pid_velocity
MotorPIDConfigurator * pid_torque
static double from_rpm(double x)
uint8_t forward_limit_triggered
void run(ClassLoader *loader)
roboteq_control::MotorStatus msg_status
serial_controller * mSerial