21 #ifndef ROBOT_CALIBRATION_PLUGINS_FEATURE_FINDER_H 22 #define ROBOT_CALIBRATION_PLUGINS_FEATURE_FINDER_H 25 #include <robot_calibration_msgs/CalibrationData.h> 47 virtual bool init(
const std::string& name,
71 virtual bool find(robot_calibration_msgs::CalibrationData * msg) = 0;
79 #endif // ROBOT_CALIBRATION_PLUGINS_FEATURE_FINDER_H
Base class for a feature finder.
virtual bool find(robot_calibration_msgs::CalibrationData *msg)=0
Once the robot has been moved into the proper position and settled, this function will be called...
virtual bool init(const std::string &name, ros::NodeHandle &nh)
Initialize the feature finder.
std::string getName()
Get the name of this feature finder.
Calibration code lives under this namespace.