#include <ros/ros.h>
#include <tf/tf.h>
#include <tf/transform_listener.h>
#include <tf/transform_broadcaster.h>
#include <boost/bind.hpp>
#include "pcl/io/pcd_io.h"
#include "pcl/point_types.h"
#include <pcl_ros/transforms.h>
#include <visualization_msgs/Marker.h>
#include <visualization_msgs/MarkerArray.h>
#include <dynamic_reconfigure/server.h>
#include "pr2_grasp_adjust/EstimateConfig.h"
#include "pr2_grasp_adjust/DebugConfig.h"
#include "pr2_grasp_adjust/GraspAdjust.h"
#include <iostream>
#include <fstream>
#include <queue>
#include <object_manipulation_msgs/GraspPlanningErrorCode.h>
#include <object_manipulator/tools/shape_tools.h>
#include <object_manipulator/tools/msg_helpers.h>
#include "gripper_model.h"
#include "helpers.h"
#include "grasp_adjust.h"
Go to the source code of this file.
Typedefs | |
typedef pcl::PointXYZRGBNormal | PointT |
Finds optimal grasps near a provided grasp pose. | |
Variables | |
const int | GLOBAL_SEARCH = pr2_grasp_adjust::Estimate_global_search |
const int | LOCAL_SEARCH = pr2_grasp_adjust::Estimate_local_search |
const int | SINGLE_POSE = pr2_grasp_adjust::Estimate_single_pose |
const double | WORST_SCORE = 0.0 |
typedef pcl::PointXYZRGBNormal PointT |
Finds optimal grasps near a provided grasp pose.
Definition at line 80 of file grasp_adjust.cpp.
const int GLOBAL_SEARCH = pr2_grasp_adjust::Estimate_global_search |
Definition at line 83 of file grasp_adjust.cpp.
const int LOCAL_SEARCH = pr2_grasp_adjust::Estimate_local_search |
Definition at line 84 of file grasp_adjust.cpp.
const int SINGLE_POSE = pr2_grasp_adjust::Estimate_single_pose |
Definition at line 85 of file grasp_adjust.cpp.
const double WORST_SCORE = 0.0 |
Definition at line 82 of file grasp_adjust.cpp.