#include <ros/ros.h>#include <math.h>#include <interactive_markers/interactive_marker_server.h>#include <interactive_markers/menu_handler.h>#include <object_manipulator/tools/mechanism_interface.h>#include <object_manipulator/tools/msg_helpers.h>#include <boost/thread.hpp>#include <tf/transform_listener.h>#include <boost/thread/recursive_mutex.hpp>#include <actionlib/client/simple_action_client.h>#include <actionlib/server/simple_action_server.h>#include <pr2_object_manipulation_msgs/GetNavPoseAction.h>#include <pr2_object_manipulation_msgs/CameraFocus.h>#include <sensor_msgs/point_cloud_conversion.h>#include "eigen_conversions/eigen_msg.h"#include "eigen3/Eigen/Geometry"#include "pcl/io/pcd_io.h"#include "pcl/point_types.h"#include "pcl_ros/transforms.h"#include <household_objects_database_msgs/GetModelDescription.h>#include <household_objects_database_msgs/GetModelMesh.h>#include <interactive_marker_helpers/interactive_marker_helpers.h>
Go to the source code of this file.
Classes | |
| class | BasePoseAction |
| An action for getting a full robot pose using interactive markers. More... | |
Functions | |
| int | main (int argc, char **argv) |
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 474 of file pr2_interactive_nav_action.cpp.