Go to the documentation of this file.00001 #include <string>
00002 #include <algorithm>
00003 #include <ros/ros.h>
00004 #include <rtklib/rtklib.h>
00005
00006 int loadrosopts(opt_t *opts)
00007 {
00008 ros::NodeHandle private_nh("~");
00009 for (opt_t *opt = opts; opt->var != NULL; opt++) {
00010 std::string value;
00011 std::string key(opt->name);
00012 std::replace(key.begin(), key.end(), '-', '_');
00013 private_nh.param(key, value, value);
00014 if (value.empty()) continue;
00015 if (!str2opt(opt, value.c_str()))
00016 trace(1,"loadrosopts: invalid option value '%s' (%s), %d\n", value.c_str(), opt->name, value.length());
00017 }
00018 return 1;
00019 }