#include "pr2_interactive_manipulation/interactive_manipulation_backend.h"
#include <ros/ros.h>
#include <actionlib/server/simple_action_server.h>
#include <object_manipulator/tools/mechanism_interface.h>
#include <tabletop_collision_map_processing/collision_map_interface.h>
#include <object_manipulation_msgs/PickupAction.h>
#include <object_manipulation_msgs/PlaceAction.h>
#include <pr2_interactive_object_detection/GraspableObjectList.h>
#include <pr2_create_object_model/ModelObjectInHandAction.h>
#include <pr2_create_object_model/ObjectInHand.h>
#include "pr2_interactive_manipulation/gripper_controller.h"
#include "pr2_interactive_manipulation/IMGUIOptions.h"
#include "pr2_interactive_manipulation/IMGUIAdvancedOptions.h"
#include "pr2_interactive_manipulation/IMGUICommand.h"
#include "pr2_interactive_manipulation/IMGUIAction.h"
#include <sensor_msgs/PointCloud2.h>
#include <object_manipulation_msgs/Grasp.h>
#include <string>
#include <vector>
#include <ostream>
#include "ros/serialization.h"
#include "ros/builtin_message_traits.h"
#include "ros/message_operations.h"
#include "ros/message.h"
#include "ros/time.h"
#include "ros/service_traits.h"
#include "object_manipulation_msgs/GraspableObject.h"
#include "geometry_msgs/Quaternion.h"
#include "geometry_msgs/Pose.h"
#include "geometry_msgs/PoseStamped.h"
#include "object_manipulation_msgs/GraspPlanningErrorCode.h"
#include <object_manipulation_msgs/ClusterBoundingBox.h>
#include <tf/transform_datatypes.h>
#include <sensor_msgs/point_cloud_conversion.h>
Go to the source code of this file.
Namespaces | |
namespace | pr2_interactive_manipulation |
Functions | |
std::string | pr2_interactive_manipulation::getGraspResultInfo (object_manipulation_msgs::GraspResult result) |
std::string | pr2_interactive_manipulation::getPlaceLocationResultInfo (object_manipulation_msgs::PlaceLocationResult result) |
void | pr2_interactive_manipulation::populateGraspOptions (object_manipulation_msgs::PickupGoal &pickup_goal, std::string arm_name, const IMGUIOptions &options) |
void | pr2_interactive_manipulation::populatePlaceOptions (object_manipulation_msgs::PlaceGoal &place_goal, std::string arm_name, const IMGUIOptions &options) |
geometry_msgs::Pose | pr2_interactive_manipulation::preTranslatePose (geometry_msgs::Pose pose_in, btVector3 translation) |
geometry_msgs::Pose | pr2_interactive_manipulation::translatePose (geometry_msgs::Pose pose_in, btVector3 translation) |