#include <arm_mover.h>
Public Member Functions | |
ArmMover (ros::NodeHandle pnh) | |
void | joyCb (sensor_msgs::JoyConstPtr joy_msg) |
virtual | ~ArmMover () |
Public Attributes | |
ros::Publisher | command_pub_ |
int | deadman_button_ |
ros::Subscriber | joy_sub_ |
ros::Time | last_update_time_ |
ros::NodeHandle | nh_ |
geometry_msgs::PoseStamped | pose_msg_ |
double | update_freq_ |
Definition at line 43 of file arm_mover.h.
Definition at line 39 of file arm_mover.cpp.
ArmMover::~ArmMover | ( | ) | [virtual] |
Definition at line 52 of file arm_mover.cpp.
void ArmMover::joyCb | ( | sensor_msgs::JoyConstPtr | joy_msg | ) |
Definition at line 56 of file arm_mover.cpp.
Definition at line 55 of file arm_mover.h.
Definition at line 60 of file arm_mover.h.
Definition at line 53 of file arm_mover.h.
Definition at line 51 of file arm_mover.h.
Definition at line 52 of file arm_mover.h.
geometry_msgs::PoseStamped ArmMover::pose_msg_ |
Definition at line 56 of file arm_mover.h.
double ArmMover::update_freq_ |
Definition at line 58 of file arm_mover.h.