37 #include <std_msgs/Bool.h> 38 #include <roboteq_control/Service.h> 39 #include <roboteq_control/Peripheral.h> 45 #include <roboteq_control/RoboteqControllerConfig.h> 69 uint8_t serial_mode : 1;
70 uint8_t pulse_mode : 1;
71 uint8_t analog_mode : 1;
73 uint8_t power_stage_off : 1;
74 uint8_t stall_detect : 1;
76 uint8_t microbasic_running : 1;
81 uint8_t overvoltage : 1;
82 uint8_t undervoltage : 1;
83 uint8_t short_circuit : 1;
84 uint8_t emergency_stop : 1;
85 uint8_t brushless_sensor_fault : 1;
86 uint8_t mosfet_failure : 1;
121 void updateDiagnostics();
123 void initializeDiagnostic();
129 bool prepareSwitch(
const std::list<hardware_interface::ControllerInfo>& start_list,
const std::list<hardware_interface::ControllerInfo>& stop_list);
131 void doSwitch(
const std::list<hardware_interface::ControllerInfo>& start_list,
const std::list<hardware_interface::ControllerInfo>& stop_list);
174 bool first_read_ =
true;
175 double first_read_pos_[2];
187 void stop_Callback(
const std_msgs::Bool::ConstPtr& msg);
191 void getRoboteqInformation();
197 dynamic_reconfigure::Server<roboteq_control::RoboteqControllerConfig> *
ds_controller;
203 void reconfigureCBController(roboteq_control::RoboteqControllerConfig &config, uint32_t level);
211 void getControllerFromRoboteq();
219 bool service_Callback(roboteq_control::Service::Request &req, roboteq_control::Service::Response &msg_system);
serial_controller * mSerial
diagnostic_updater::Updater diagnostic_updater
ROSCONSOLE_DECL void initialize()
std::vector< GPIOAnalogConfigurator * > _param_analog
ros::Publisher pub_peripheral
roboteq_control::Peripheral msg_peripheral
urdf::Model model
URDF information about robot.
std::vector< GPIOEncoderConfigurator * > _param_encoder
std::vector< Motor * > mMotor
ros::NodeHandle private_mNh
bool _first
ROS Control interfaces.
bool setup_controller
Setup variable.
roboteq_control::RoboteqControllerConfig default_controller_config
struct roboteq::_status_flag status_flag_t
std::vector< GPIOPulseConfigurator * > _param_pulse
struct roboteq::joint joint_t
struct roboteq::_status_fault status_fault_t
void run(ClassLoader *loader)
dynamic_reconfigure::Server< roboteq_control::RoboteqControllerConfig > * ds_controller
Dynamic reconfigure PID.
ros::ServiceServer srv_board