#include "object_manipulator/object_manipulator.h"#include <algorithm>#include "object_manipulator/grasp_execution/grasp_executor_with_approach.h"#include "object_manipulator/grasp_execution/reactive_grasp_executor.h"#include "object_manipulator/place_execution/place_executor.h"#include <ros/ros.h>#include <geometry_msgs/Pose.h>#include <tf/transform_listener.h>#include <object_manipulation_msgs/PlaceGoal.h>#include <object_manipulation_msgs/PlaceLocationResult.h>#include "object_manipulator/tools/mechanism_interface.h"#include "object_manipulator/tools/grasp_marker_publisher.h"#include "object_manipulator/tools/exceptions.h"

Go to the source code of this file.
Namespaces | |
| namespace | object_manipulator |
Helper functions for using image regions of PointCloud2s. | |