Go to the documentation of this file.00001
00007 #include <ros/ros.h>
00008 #include "../include/grasp_server.h"
00009
00010
00012
00014
00015 int main(int argc, char **argv)
00016 {
00017 ros::init(argc, argv, "grasp_server");
00018
00019 double spin_frequency=100;
00020 std::string searched_param;
00021 ros::NodeHandle nh_private_("~");
00022
00023 if(nh_private_.searchParam("spin_frequency",searched_param))
00024 nh_private_.getParam(searched_param, spin_frequency);
00025
00026 ICR::GraspServer grasp_server;
00027 ROS_INFO("Grasp server ready");
00028
00029 ros::Rate r(spin_frequency);
00030 while(ros::ok())
00031 {
00032 grasp_server.spin();
00033 r.sleep();
00034 }
00035 return 0;
00036 }
00037