31 #ifndef MOTORHARDWARE_H 32 #define MOTORHARDWARE_H 38 #include "sensor_msgs/JointState.h" 40 #include "std_msgs/Int32.h" 41 #include "std_msgs/UInt32.h" 46 #include <gtest/gtest_prod.h> 86 Joint() : position(0), velocity(0), effort(0), velocity_command(0) {}
void _addOdometryRequest(std::vector< MotorMessage > &commands) const
FirmwareParams prev_pid_params
int16_t calculateTicsFromRadians(double radians) const
hardware_interface::JointStateInterface joint_state_interface_
void _addVelocityRequest(std::vector< MotorMessage > &commands) const
ros::Publisher rightError
static FirmwareParams firmware_params
struct MotorHardware::Joint joints_[2]
void setDeadmanTimer(int32_t deadman)
void setDebugLeds(bool led1, bool led2)
void setParams(FirmwareParams firmware_params)
FirmwareParams pid_params
static CommsParams serial_params
FRIEND_TEST(MotorHardwareTests, nonZeroWriteSpeedsOutputs)
double calculateRadiansFromTics(int16_t tics) const
hardware_interface::VelocityJointInterface velocity_joint_interface_
MotorSerial * motor_serial_
MotorHardware(ros::NodeHandle nh, CommsParams serial_params, FirmwareParams firmware_params)