#include <string>#include <ros/ros.h>#include <pr2_controllers_msgs/PointHeadAction.h>#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 "std_msgs/Header.h"#include "actionlib_msgs/GoalID.h"#include "geometry_msgs/PointStamped.h"#include "geometry_msgs/Vector3.h"#include "actionlib_msgs/GoalStatus.h"#include <actionlib/client/simple_action_client.h>#include <geometry_msgs/PoseStamped.h>#include <tf/transform_listener.h>

Go to the source code of this file.
Classes | |
| class | simple_robot_control::Head |
Namespaces | |
| namespace | simple_robot_control |
Variables | |
| static const string | simple_robot_control::DEFAULT_HEAD_POINTING_FRAME = "high_def_frame" |