00001 /* 00002 * overhead_grasp_service_server.cpp 00003 * 00004 * Created on: Oct 17, 2012 00005 */ 00006 00007 #include <object_manipulation_tools/services/GraspPlannerServer.h> 00008 #include <object_manipulation_tools/grasp_planners/OverheadGraspPlanner.h> 00009 00010 int main(int argc, char** argv) 00011 { 00012 ros::init(argc,argv,"grasp_planner_server"); 00013 ros::NodeHandle nh; 00014 00015 boost::shared_ptr<GraspPlannerInterface> planner(new OverheadGraspPlanner()); 00016 GraspPlannerServer graspPlannerServer = GraspPlannerServer(planner); 00017 graspPlannerServer.init(); 00018 00019 return 0; 00020 }