#include <ros/ros.h>
#include <actionlib/client/simple_action_client.h>
#include <actionlib/server/simple_action_server.h>
#include <boost/thread/recursive_mutex.hpp>
#include <geometry_msgs/PoseArray.h>
#include <interactive_markers/interactive_marker_server.h>
#include <rail_manipulation_msgs/PickupAction.h>
#include <remote_manipulation_markers/Common.h>
#include <remote_manipulation_markers/CycleGrasps.h>
#include <remote_manipulation_markers/SpecifiedGraspAction.h>
#include <tf/transform_broadcaster.h>
#include <tf/transform_listener.h>
Go to the source code of this file.
Classes | |
class | PointAndClick |