Public Member Functions | Public Attributes | List of all members
TeleopPR2 Class Reference

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 ()
 

Public Attributes

int axis_pan
 
int axis_tilt
 
int axis_vw
 
int axis_vx
 
int axis_vy
 
geometry_msgs::Twist cmd
 
bool cmd_head
 
bool deadman_
 
int deadman_button
 
bool deadman_no_publish_
 
int head_button
 
ros::Publisher head_pub_
 
bool head_publish_
 
ros::Subscriber head_state_sub_
 
ros::Duration joy_msg_timeout_
 
ros::Subscriber joy_sub_
 
bool last_deadman_
 
sensor_msgs::Joy last_processed_joy_message_
 
ros::Time last_recieved_joy_message_time_
 
std::string last_selected_topic_
 
double max_pan
 
double max_tilt
 
double max_torso
 
double max_vw
 
double max_vw_run
 
double max_vx
 
double max_vx_run
 
double max_vy
 
double max_vy_run
 
double min_tilt
 
double min_torso
 
ros::ServiceClient mux_client_
 
ros::NodeHandle n_
 
ros::NodeHandle n_private_
 
double pan_step
 
double req_pan
 
double req_pan_vel
 
double req_tilt
 
double req_tilt_vel
 
double req_torso
 
double req_torso_vel
 
double req_vw
 
double req_vx
 
double req_vy
 
int run_button
 
double tilt_step
 
int torso_dn_button
 
ros::Publisher torso_pub_
 
bool torso_publish_
 
ros::Subscriber torso_state_sub_
 
double torso_step
 
int torso_up_button
 
bool use_mux_
 
ros::Publisher vel_pub_
 

Detailed Description

Definition at line 56 of file teleop_pr2.cpp.

Constructor & Destructor Documentation

TeleopPR2::TeleopPR2 ( bool  deadman_no_publish = false)
inline

Definition at line 89 of file teleop_pr2.cpp.

TeleopPR2::~TeleopPR2 ( )
inline

Definition at line 207 of file teleop_pr2.cpp.

Member Function Documentation

void TeleopPR2::headCB ( const pr2_controllers_msgs::JointTrajectoryControllerState::ConstPtr &  msg)
inline

Definition at line 394 of file teleop_pr2.cpp.

void TeleopPR2::init ( )
inline

Definition at line 101 of file teleop_pr2.cpp.

void TeleopPR2::joy_cb ( const sensor_msgs::Joy::ConstPtr &  joy_msg)
inline

Callback for joy topic

Definition at line 210 of file teleop_pr2.cpp.

void TeleopPR2::send_cmd_vel ( )
inline

Definition at line 287 of file teleop_pr2.cpp.

void TeleopPR2::torsoCB ( const pr2_controllers_msgs::JointTrajectoryControllerState::ConstPtr &  msg)
inline

Definition at line 384 of file teleop_pr2.cpp.

Member Data Documentation

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.


The documentation for this class was generated from the following file:


pr2_teleop
Author(s):
autogenerated on Thu Jun 6 2019 19:18:47