Go to the documentation of this file.
21 #ifndef ROBOT_CALIBRATION_FEATURE_FINDER_LOADER_H
22 #define ROBOT_CALIBRATION_FEATURE_FINDER_LOADER_H
25 #include <boost/shared_ptr.hpp>
44 plugin_loader_(
"robot_calibration",
"robot_calibration::FeatureFinder")
56 if (!nh.
getParam(
"features", finder_params))
58 ROS_FATAL(
"Parameter 'features' is not set!");
65 ROS_FATAL(
"Parameter 'features' should be a struct.");
70 ROS_INFO(
"Loading %d feature finders.", (
int)finder_params.
size());
72 it != finder_params.
end();
76 std::string
name =
static_cast<std::string
>(it->first);
81 if (!finder_handle.
getParam(
"type", type))
83 ROS_FATAL(
"Feature finder %s has no type defined",
name.c_str());
91 if (finder && finder->init(
name, finder_handle))
92 features[
name] = finder;
103 #endif // ROBOT_CALIBRATION_FEATURE_FINDER_LOADER_H
std::map< std::string, FeatureFinderPtr > FeatureFinderMap
Load feature finders, based on param server config.
bool getParam(const std::string &key, bool &b) const
boost::shared_ptr< FeatureFinder > FeatureFinderPtr
bool load(ros::NodeHandle &nh, FeatureFinderMap &features)
ValueStruct::iterator iterator
const Type & getType() const
boost::shared_ptr< T > createInstance(const std::string &lookup_name)
Calibration code lives under this namespace.
pluginlib::ClassLoader< robot_calibration::FeatureFinder > plugin_loader_
robot_calibration
Author(s): Michael Ferguson
autogenerated on Fri Sep 1 2023 02:52:01