#include <ros/ros.h>
#include <object_manipulator/object_manipulator.h>
#include <object_manipulation_msgs/GraspPlanning.h>
#include <ros/package.h>
#include <object_manipulation_tools/grasp_planners/OverheadGraspPlanner.h>
#include <geometry_msgs/Polygon.h>
#include <geometry_msgs/PolygonStamped.h>
#include <boost/shared_ptr.hpp>
Go to the source code of this file.
Classes | |
class | GraspPlannerServer |
Variables | |
const std::string | PARAM_NAME_PUBLISH_RESULTS = "publish_results" |
const std::string | PLANE_PUBLISH_TOPIC_NAME = "contact_plane" |
const std::string | POSE_PUBLISH_TOPIC_NAME = "grasp_poses" |
const std::string | SERVICE_NAME = "plan_point_cluster_grasp" |
const std::string PARAM_NAME_PUBLISH_RESULTS = "publish_results" |
Definition at line 23 of file GraspPlannerServer.h.
const std::string PLANE_PUBLISH_TOPIC_NAME = "contact_plane" |
Definition at line 22 of file GraspPlannerServer.h.
const std::string POSE_PUBLISH_TOPIC_NAME = "grasp_poses" |
Definition at line 21 of file GraspPlannerServer.h.
const std::string SERVICE_NAME = "plan_point_cluster_grasp" |
Definition at line 20 of file GraspPlannerServer.h.