feature_finder.h
Go to the documentation of this file.
1 /*
2  * Copyright (C) 2018 Michael Ferguson
3  * Copyright (C) 2015 Fetch Robotics Inc.
4  * Copyright (C) 2013-2014 Unbounded Robotics Inc.
5  *
6  * Licensed under the Apache License, Version 2.0 (the "License");
7  * you may not use this file except in compliance with the License.
8  * You may obtain a copy of the License at
9  *
10  * http://www.apache.org/licenses/LICENSE-2.0
11  *
12  * Unless required by applicable law or agreed to in writing, software
13  * distributed under the License is distributed on an "AS IS" BASIS,
14  * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied.
15  * See the License for the specific language governing permissions and
16  * limitations under the License.
17  */
18 
19 // Author: Michael Ferguson
20 
21 #ifndef ROBOT_CALIBRATION_PLUGINS_FEATURE_FINDER_H
22 #define ROBOT_CALIBRATION_PLUGINS_FEATURE_FINDER_H
23 
24 #include <ros/ros.h>
25 #include <robot_calibration_msgs/CalibrationData.h>
26 
27 namespace robot_calibration
28 {
29 
34 {
35 public:
36  // pluginlib requires empty constructor
38  virtual ~FeatureFinder() {};
39 
47  virtual bool init(const std::string& name,
48  ros::NodeHandle & nh)
49  {
50  name_ = name;
51  return true;
52  };
53 
57  std::string getName()
58  {
59  return name_;
60  }
61 
71  virtual bool find(robot_calibration_msgs::CalibrationData * msg) = 0;
72 
73 private:
74  std::string name_;
75 };
76 
77 } // namespace robot_calibration
78 
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.


robot_calibration
Author(s): Michael Ferguson
autogenerated on Tue Nov 3 2020 17:30:30