18 #include <gtest/gtest.h> 20 TEST(FeatureFinderLoaderTests, test_feature_finder_loader)
25 bool result = loader.
load(nh, features);
27 EXPECT_EQ(
true, result);
28 EXPECT_EQ(static_cast<size_t>(2), features.size());
31 int main(
int argc,
char** argv)
33 ros::init(argc, argv,
"feature_finder_loader_tests");
34 testing::InitGoogleTest(&argc, argv);
35 return RUN_ALL_TESTS();
TEST(FeatureFinderLoaderTests, test_feature_finder_loader)
std::map< std::string, FeatureFinderPtr > FeatureFinderMap
ROSCPP_DECL void init(int &argc, char **argv, const std::string &name, uint32_t options=0)
Load feature finders, based on param server config.
int main(int argc, char **argv)
bool load(ros::NodeHandle &nh, FeatureFinderMap &features)