Go to the documentation of this file.
31 #ifndef UBIQUITY_MOTOR_MOTOR_PARMETERS_H
32 #define UBIQUITY_MOTOR_MOTOR_PARMETERS_H
37 #define ROS_TOPIC_SYSTEM_CONTROL "system_control" // A topic for system level control commands
38 #define MOTOR_CONTROL_CMD "motor_control" // A mnumonic for a motor control system command
39 #define MOTOR_CONTROL_ENABLE "enable" // Parameter for MOTOR_CONTROL_CMD to enable control
40 #define MOTOR_CONTROL_DISABLE "disable" // Parameter for MOTOR_CONTROL_CMD to enable control
41 #define MOTOR_SPEED_CONTROL_CMD "speed_control" // A mnumonic for disable of speed to avoid colision
44 #define WHEEL_GEAR_RATIO_1 ((double)(4.294)) // Default original motor gear ratio for Magni
45 #define WHEEL_GEAR_RATIO_2 ((double)(5.170)) // 2nd version standard Magni wheels gear ratio
50 T value = default_val;
51 if (!nh.
getParam(parameter_name, value)) {
158 nh,
"ubiquity_motor/fw_max_pwm",
max_pwm);
188 nh,
"ubiquity_motor/serial_baud",
baud_rate);
233 #endif // UBIQUITY_MOTOR_MOTOR_PARMETERS_H
void setParam(const std::string &key, bool b) const
float battery_voltage_offset
bool getParam(const std::string &key, bool &b) const
double controller_loop_rate
T getParamOrDefault(ros::NodeHandle nh, std::string parameter_name, T default_val)
float battery_voltage_critical
std::string wheel_direction
float battery_voltage_multiplier
float battery_voltage_low_level
#define WHEEL_GEAR_RATIO_1
CommsParams(ros::NodeHandle nh)
int32_t estop_pid_threshold
FirmwareParams(ros::NodeHandle nh)
int32_t controller_board_version
NodeParams(ros::NodeHandle nh)
int32_t pid_moving_buffer_size