Public Member Functions | |
void | headCB (const pr2_controllers_msgs::JointTrajectoryControllerState::ConstPtr &msg) |
void | init () |
void | joy_cb (const sensor_msgs::Joy::ConstPtr &joy_msg) |
void | send_cmd_vel () |
TeleopPR2 (bool deadman_no_publish=false) | |
void | torsoCB (const pr2_controllers_msgs::JointTrajectoryControllerState::ConstPtr &msg) |
~TeleopPR2 () | |
Definition at line 56 of file teleop_pr2.cpp.
|
inline |
Definition at line 89 of file teleop_pr2.cpp.
|
inline |
Definition at line 207 of file teleop_pr2.cpp.
|
inline |
Definition at line 394 of file teleop_pr2.cpp.
|
inline |
Definition at line 101 of file teleop_pr2.cpp.
|
inline |
Callback for joy topic
Definition at line 210 of file teleop_pr2.cpp.
|
inline |
Definition at line 287 of file teleop_pr2.cpp.
|
inline |
Definition at line 384 of file teleop_pr2.cpp.
int TeleopPR2::axis_pan |
Definition at line 67 of file teleop_pr2.cpp.
int TeleopPR2::axis_tilt |
Definition at line 67 of file teleop_pr2.cpp.
int TeleopPR2::axis_vw |
Definition at line 67 of file teleop_pr2.cpp.
int TeleopPR2::axis_vx |
Definition at line 67 of file teleop_pr2.cpp.
int TeleopPR2::axis_vy |
Definition at line 67 of file teleop_pr2.cpp.
geometry_msgs::Twist TeleopPR2::cmd |
Definition at line 59 of file teleop_pr2.cpp.
bool TeleopPR2::cmd_head |
Definition at line 71 of file teleop_pr2.cpp.
bool TeleopPR2::deadman_ |
Definition at line 71 of file teleop_pr2.cpp.
int TeleopPR2::deadman_button |
Definition at line 68 of file teleop_pr2.cpp.
bool TeleopPR2::deadman_no_publish_ |
Definition at line 69 of file teleop_pr2.cpp.
int TeleopPR2::head_button |
Definition at line 68 of file teleop_pr2.cpp.
ros::Publisher TeleopPR2::head_pub_ |
Definition at line 82 of file teleop_pr2.cpp.
bool TeleopPR2::head_publish_ |
Definition at line 69 of file teleop_pr2.cpp.
ros::Subscriber TeleopPR2::head_state_sub_ |
Definition at line 86 of file teleop_pr2.cpp.
ros::Duration TeleopPR2::joy_msg_timeout_ |
Definition at line 78 of file teleop_pr2.cpp.
ros::Subscriber TeleopPR2::joy_sub_ |
Definition at line 84 of file teleop_pr2.cpp.
bool TeleopPR2::last_deadman_ |
Definition at line 72 of file teleop_pr2.cpp.
sensor_msgs::Joy TeleopPR2::last_processed_joy_message_ |
Definition at line 75 of file teleop_pr2.cpp.
ros::Time TeleopPR2::last_recieved_joy_message_time_ |
Definition at line 77 of file teleop_pr2.cpp.
std::string TeleopPR2::last_selected_topic_ |
Definition at line 73 of file teleop_pr2.cpp.
double TeleopPR2::max_pan |
Definition at line 66 of file teleop_pr2.cpp.
double TeleopPR2::max_tilt |
Definition at line 66 of file teleop_pr2.cpp.
double TeleopPR2::max_torso |
Definition at line 60 of file teleop_pr2.cpp.
double TeleopPR2::max_vw |
Definition at line 65 of file teleop_pr2.cpp.
double TeleopPR2::max_vw_run |
Definition at line 65 of file teleop_pr2.cpp.
double TeleopPR2::max_vx |
Definition at line 65 of file teleop_pr2.cpp.
double TeleopPR2::max_vx_run |
Definition at line 65 of file teleop_pr2.cpp.
double TeleopPR2::max_vy |
Definition at line 65 of file teleop_pr2.cpp.
double TeleopPR2::max_vy_run |
Definition at line 65 of file teleop_pr2.cpp.
double TeleopPR2::min_tilt |
Definition at line 66 of file teleop_pr2.cpp.
double TeleopPR2::min_torso |
Definition at line 60 of file teleop_pr2.cpp.
ros::ServiceClient TeleopPR2::mux_client_ |
Definition at line 87 of file teleop_pr2.cpp.
ros::NodeHandle TeleopPR2::n_ |
Definition at line 80 of file teleop_pr2.cpp.
ros::NodeHandle TeleopPR2::n_private_ |
Definition at line 80 of file teleop_pr2.cpp.
double TeleopPR2::pan_step |
Definition at line 66 of file teleop_pr2.cpp.
double TeleopPR2::req_pan |
Definition at line 63 of file teleop_pr2.cpp.
double TeleopPR2::req_pan_vel |
Definition at line 64 of file teleop_pr2.cpp.
double TeleopPR2::req_tilt |
Definition at line 63 of file teleop_pr2.cpp.
double TeleopPR2::req_tilt_vel |
Definition at line 64 of file teleop_pr2.cpp.
double TeleopPR2::req_torso |
Definition at line 63 of file teleop_pr2.cpp.
double TeleopPR2::req_torso_vel |
Definition at line 61 of file teleop_pr2.cpp.
double TeleopPR2::req_vw |
Definition at line 63 of file teleop_pr2.cpp.
double TeleopPR2::req_vx |
Definition at line 63 of file teleop_pr2.cpp.
double TeleopPR2::req_vy |
Definition at line 63 of file teleop_pr2.cpp.
int TeleopPR2::run_button |
Definition at line 68 of file teleop_pr2.cpp.
double TeleopPR2::tilt_step |
Definition at line 66 of file teleop_pr2.cpp.
int TeleopPR2::torso_dn_button |
Definition at line 68 of file teleop_pr2.cpp.
ros::Publisher TeleopPR2::torso_pub_ |
Definition at line 83 of file teleop_pr2.cpp.
bool TeleopPR2::torso_publish_ |
Definition at line 69 of file teleop_pr2.cpp.
ros::Subscriber TeleopPR2::torso_state_sub_ |
Definition at line 85 of file teleop_pr2.cpp.
double TeleopPR2::torso_step |
Definition at line 61 of file teleop_pr2.cpp.
int TeleopPR2::torso_up_button |
Definition at line 68 of file teleop_pr2.cpp.
bool TeleopPR2::use_mux_ |
Definition at line 72 of file teleop_pr2.cpp.
ros::Publisher TeleopPR2::vel_pub_ |
Definition at line 81 of file teleop_pr2.cpp.