#include <head_pointer.h>
Public Types | |
| typedef actionlib::SimpleActionClient < pr2_controllers_msgs::PointHeadAction > | PointHeadActionClient |
Public Member Functions | |
| HeadPointer (ros::NodeHandle pnh, std::string action_topic) | |
| void | joyCb (sensor_msgs::JoyConstPtr joy_msg) |
| virtual | ~HeadPointer () |
Public Attributes | |
| int | deadman_button_ |
| ros::Subscriber | joy_sub_ |
| ros::Time | last_update_time_ |
| ros::NodeHandle | nh_ |
| PointHeadActionClient | point_head_action_client_ |
| pr2_controllers_msgs::PointHeadGoal | point_head_goal_ |
| double | update_freq_ |
Definition at line 45 of file head_pointer.h.
| typedef actionlib::SimpleActionClient<pr2_controllers_msgs::PointHeadAction> HeadPointer::PointHeadActionClient |
Definition at line 53 of file head_pointer.h.
| HeadPointer::HeadPointer | ( | ros::NodeHandle | pnh, |
| std::string | action_topic | ||
| ) |
Definition at line 37 of file head_pointer.cpp.
| HeadPointer::~HeadPointer | ( | ) | [virtual] |
Definition at line 59 of file head_pointer.cpp.
| void HeadPointer::joyCb | ( | sensor_msgs::JoyConstPtr | joy_msg | ) |
Definition at line 63 of file head_pointer.cpp.
Definition at line 64 of file head_pointer.h.
Definition at line 58 of file head_pointer.h.
Definition at line 56 of file head_pointer.h.
Definition at line 57 of file head_pointer.h.
Definition at line 54 of file head_pointer.h.
Definition at line 60 of file head_pointer.h.
| double HeadPointer::update_freq_ |
Definition at line 62 of file head_pointer.h.