#include <ros/ros.h>#include <std_msgs/Float64MultiArray.h>#include <tf/transform_listener.h>#include <geometry_msgs/PoseStamped.h>#include <actionlib/client/simple_action_client.h>#include <pr2_controllers_msgs/PointHeadAction.h>#include <moveit/planning_scene_interface/planning_scene_interface.h>#include <std_srvs/SetBool.h>Go to the source code of this file.
Typedefs | |
| typedef actionlib::SimpleActionClient < pr2_controllers_msgs::PointHeadAction > | PointHeadClient |
Functions | |
| void | callback (const geometry_msgs::PoseStamped::ConstPtr &pose) |
| int | main (int argc, char **argv) |
Variables | |
| PointHeadClient * | point_head_client |
| typedef actionlib::SimpleActionClient<pr2_controllers_msgs::PointHeadAction> PointHeadClient |
Definition at line 13 of file pan_tilt_object_tracking.cpp.
| void callback | ( | const geometry_msgs::PoseStamped::ConstPtr & | pose | ) |
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 56 of file pan_tilt_object_tracking.cpp.
Definition at line 17 of file pan_tilt_object_tracking.cpp.