32 #ifndef HUSKY_BASE_HUSKY_HARDWARE_H 33 #define HUSKY_BASE_HUSKY_HARDWARE_H 41 #include "sensor_msgs/JointState.h" 42 #include "husky_msgs/HuskyStatus.h" 111 position(0), velocity(0), effort(0), velocity_command(0)
117 #endif // HUSKY_BASE_HUSKY_HARDWARE_H
ros::Publisher diagnostic_publisher_
HuskySoftwareDiagnosticTask software_status_task_
HuskyHardwareDiagnosticTask< clearpath::DataSafetySystemStatus > safety_status_task_
husky_msgs::HuskyStatus husky_status_msg_
void reportLoopDuration(const ros::Duration &duration)
void initializeDiagnostics()
struct husky_base::HuskyHardware::Joint joints_[4]
void registerControlInterfaces()
TFSIMD_FORCE_INLINE tfScalar angle(const Quaternion &q1, const Quaternion &q2)
hardware_interface::JointStateInterface joint_state_interface_
diagnostic_updater::Updater diagnostic_updater_
ros::NodeHandle private_nh_
HuskyHardwareDiagnosticTask< clearpath::DataSystemStatus > system_status_task_
double linearToAngular(const double &travel) const
void updateJointsFromHardware()
hardware_interface::VelocityJointInterface velocity_joint_interface_
double angularToLinear(const double &angle) const
HuskyHardware(ros::NodeHandle nh, ros::NodeHandle private_nh, double target_control_freq)
void writeCommandsToHardware()
void limitDifferentialSpeed(double &travel_speed_left, double &travel_speed_right)
HuskyHardwareDiagnosticTask< clearpath::DataPowerSystem > power_status_task_