Go to the documentation of this file.00001 #include <string>
00002
00003 #include <ros/console.h>
00004
00005 #include <nj_oa_costmap/jockey.h>
00006
00007 int main(int argc, char **argv)
00008 {
00009 ros::init(argc, argv, "nj_oa_costmap");
00010 ros::NodeHandle private_nh("~");
00011
00012
00013 if(ros::console::set_logger_level(ROSCONSOLE_DEFAULT_NAME, ros::console::levels::Debug))
00014 {
00015 ros::console::notifyLoggerLevelsChanged();
00016 }
00017
00018
00019 if (!private_nh.hasParam("robot_radius"))
00020 {
00021 ROS_ERROR("Parameter %s/robot_radius not set, exiting", private_nh.getNamespace().c_str());
00022 return 1;
00023 }
00024 double robot_radius;
00025 private_nh.param<double>("robot_radius", robot_radius, 0.0);
00026
00027 std::string navigating_jockey_name;
00028 private_nh.param<std::string>("navigating_jockey_server_name",
00029 navigating_jockey_name, ros::this_node::getName() + "_server");
00030
00031 nj_oa_costmap::Jockey jockey(navigating_jockey_name, robot_radius);
00032
00033 ROS_INFO_STREAM(ros::this_node::getName() << " started (with server " << jockey.getName() << ")");
00034 ros::spin();
00035 return 0;
00036 }
00037
00038