27 #include <ISM/tools/DataCleaner.hpp> 34 if (!nh.
getParam(
"databases", database_files) || database_files.empty())
36 ROS_INFO(
"Missing parameter: \"databases\"");
41 std::stringstream info;
43 for (
const std::string& file : database_files)
45 info << std::endl <<
"\t" << file;
50 if (!nh.
getParam(
"clean_records", clean_records))
52 ROS_INFO(
"Missing parameter: \"clean_records\"");
60 if (!nh.
getParam(
"clean_models", clean_models))
62 ROS_INFO(
"Missing parameter: \"clean_models\"");
74 int main (
int argc,
char **argv)
79 ISM::DataCleaner data_cleaner;
81 std::vector<std::string> database_files;
89 data_cleaner.cleanRecords(database_files);
94 data_cleaner.cleanModels(database_files);
96 ROS_INFO(
"DATA CLEANING COMPLETED!");
100 ROS_INFO(
"DATA CLEANING ABORTED! Check launch-file for missing parameter.");
bool getNodeParameters(ros::NodeHandle nh, std::vector< std::string > &database_files, bool &clean_records, bool &clean_models)
ROSCPP_DECL void init(int &argc, char **argv, const std::string &name, uint32_t options=0)
int main(int argc, char **argv)
#define ROS_INFO_STREAM(args)
bool getParam(const std::string &key, std::string &s) const