#include "pr2_interactive_manipulation/interactive_manipulation_backend.h"
#include <std_msgs/String.h>
#include <tf/transform_datatypes.h>
#include <tf/transform_listener.h>
#include <object_manipulation_msgs/Grasp.h>
#include <object_manipulation_msgs/ClusterBoundingBox.h>
#include <object_manipulation_msgs/tools.h>
#include <object_manipulator/tools/vector_tools.h>
#include <object_manipulator/tools/arm_configurations.h>
#include <sensor_msgs/point_cloud_conversion.h>
Go to the source code of this file.
Namespaces | |
namespace | pr2_interactive_manipulation |
Typedefs | |
typedef actionlib::SimpleActionClient < object_manipulation_msgs::PickupAction > | pr2_interactive_manipulation::PickupClient |
Functions | |
void | pr2_interactive_manipulation::populateGraspOptions (const pr2_object_manipulation_msgs::IMGUIOptions &options, object_manipulation_msgs::PickupGoal &pickup_goal) |
void | pr2_interactive_manipulation::populatePlaceOptions (object_manipulation_msgs::PlaceGoal &place_goal, const pr2_object_manipulation_msgs::IMGUIOptions &options) |
geometry_msgs::Pose | pr2_interactive_manipulation::preTranslatePose (geometry_msgs::Pose pose_in, tf::Vector3 translation) |
geometry_msgs::Pose | pr2_interactive_manipulation::translatePose (geometry_msgs::Pose pose_in, tf::Vector3 translation) |