8 #ifndef MARTY_CALIBRATION_HPP 9 #define MARTY_CALIBRATION_HPP 20 #include <ros/package.h> 23 #include <std_msgs/Bool.h> 24 #include <marty_msgs/ServoMsg.h> 25 #include <marty_msgs/ServoMsgArray.h>
ros::Publisher joint_pub_
marty_msgs::ServoMsgArray joints_
marty_msgs::ServoMsgArray cal_vals_
ros::Publisher enable_pub_
Calibration(ros::NodeHandle &nh)