pbd_world_node.cpp
Go to the documentation of this file.
00001 #include "fetch_pbd_interaction/world.h"
00002 
00003 using fetch_pbd_interaction::World;
00004 
00005 int main(int argc, char **argv)
00006 {
00007   ros::init(argc, argv, "pbd_world_node");
00008   ros::NodeHandle n, pn("~");
00009   ros::AsyncSpinner spinner(2);
00010   spinner.start();
00011   std::string grasp_suggestion_service;
00012   std::string segmentation_service_name;
00013   std::string segmented_objects_topic_name;
00014   std::string segmented_table_topic_name;
00015   std::string planning_scene_topic;
00016   float obj_similar_dist_threshold;
00017   float obj_add_dist_threshold;
00018   float obj_nearest_dist_threshold;
00019   float obj_dist_zero_clamp;
00020   float text_height;
00021   float surface_height;
00022   float text_offset;
00023   std::string base_frame;
00024 
00025   pn.getParam("grasp_suggestion_service", grasp_suggestion_service);
00026   pn.getParam("segmentation_service", segmentation_service_name);
00027   pn.getParam("segmented_objects_topic", segmented_objects_topic_name);
00028   pn.getParam("segmented_table_topic", segmented_table_topic_name);
00029   pn.getParam("planning_scene_topic", planning_scene_topic);
00030   pn.getParam("object_similar_distance_threshold", obj_similar_dist_threshold);
00031   pn.getParam("object_add_distance_threshold", obj_add_dist_threshold);
00032   pn.getParam("object_nearest_distance_threshold", obj_nearest_dist_threshold);
00033   pn.getParam("object_distance_zero_clamp", obj_dist_zero_clamp);
00034   pn.getParam("text_height", text_height);
00035   pn.getParam("surface_height", surface_height);
00036   pn.getParam("text_offset", text_offset);
00037   pn.getParam("base_frame", base_frame);
00038 
00039   World world(n, pn, grasp_suggestion_service, 
00040               segmentation_service_name, segmented_objects_topic_name, segmented_table_topic_name,
00041               planning_scene_topic, obj_similar_dist_threshold, obj_add_dist_threshold,
00042               obj_nearest_dist_threshold, 
00043               obj_dist_zero_clamp, text_height, surface_height, text_offset, base_frame);
00044   ros::Rate r(10);
00045   while (ros::ok())
00046   {
00047     world.update();
00048     r.sleep();
00049   }
00050 
00051   return 0;
00052 }


fetch_pbd_interaction
Author(s): Sarah Elliott
autogenerated on Thu Jun 6 2019 18:27:21