33 #ifndef roch_BASE_roch_HARDWARE_H 34 #define roch_BASE_roch_HARDWARE_H 43 #include "sensor_msgs/JointState.h" 44 #include "roch_msgs/RochStatus.h" 45 #include "roch_msgs/CliffEvent.h" 46 #include "roch_msgs/UltEvent.h" 47 #include "roch_msgs/PSDEvent.h" 48 #include "roch_msgs/SensorState.h" 49 #include <sensor_msgs/Imu.h> 54 #include <std_msgs/String.h> 117 void publishUltEvent(
const double &left,
const double ¢er,
const double &right);
119 void publishPSDEvent(
const double &left,
const double ¢er,
const double &right);
171 position(0), velocity(0), effort(0), velocity_command(0)
184 X(0), X_Offset(0), Y(0), Y_Offset(0), Z(0), Z_Offset(0)
196 angle(0), angle_rate(0), angle_rate_offset(0), angle_offset(0)
253 #endif // ROCH_BASE_ROCH_HARDWARE_H
void publishPSDEvent(const double &left, const double ¢er, const double &right)
hardware_interface::JointStateInterface joint_state_interface_
ros::Publisher raw_data_command_publisher_
rochSoftwareDiagnosticTask software_status_task_
ros::Publisher diagnostic_publisher_
void reportLoopDuration(const ros::Duration &duration)
void publishUltEvent(const double &left, const double ¢er, const double &right)
void getRangefinderData()
double linearToAngular(const double &travel) const
ros::Publisher ult_event_publisher_
void limitDifferentialSpeed(double &travel_speed_left, double &travel_speed_right)
hardware_interface::VelocityJointInterface velocity_joint_interface_
void publishSensorState()
void registerControlInterfaces()
void updateJointsFromHardware()
ros::Publisher cliff_event_publisher_
std::vector< double > psdbottom
double angularToLinear(const double &angle) const
void publishWheelEvent(const float &leftOffset, const float &rightOffset)
double angular_velocity_covariance[9]
ros::Publisher psd_event_publisher_
struct roch_base::rochHardware::ThreeAxisGyro gyroData
struct roch_base::rochHardware::SixAxisGyro sixGyro
double linear_acceleration_covariance[9]
roch_msgs::RochStatus roch_status_msg_
std::string gyro_link_frame_
rochHardwareDiagnosticTask< sawyer::DataPowerSystem > power_status_task_
void writeOverallSpeedCommandsToHardware()
diagnostic_updater::Updater diagnostic_updater_
std::vector< double > ultbottom
rochHardwareDiagnosticTask< sawyer::DataSystemStatus > system_status_task_
double orientation_covariance[9]
CliffEvent leftcliffevent
void publishCliffEvent(const double &left, const double &right)
void writeCommandsToHardware()
ros::Publisher sensor_state_publisher_
hardware_interface::ImuSensorHandle::Data imuMsgData
ros::NodeHandle private_nh_
void getDifferentControlConstantData()
hardware_interface::ImuSensorInterface imu_sensor_interface_
rochHardwareDiagnosticTask< sawyer::DataSafetySystemStatus > safety_status_task_
double linear_acceleration[3]
std::vector< double > cliffbottom
CliffEvent rightcliffevent
struct roch_base::rochHardware::Joint joints_[2]
rochHardware(ros::NodeHandle nh, ros::NodeHandle private_nh, double target_control_freq)
void initializeDiagnostics()
double angular_velocity[3]