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

Public Member Functions

void init ()
 
void joy_cb (const sensor_msgs::Joy::ConstPtr &joy_msg)
 
void passthrough_cb (const geometry_msgs::TwistConstPtr &pass_msg)
 
void send_cmd_vel ()
 
 TeleopBase (bool deadman_no_publish=false)
 
 ~TeleopBase ()
 

Public Attributes

int axis_vw
 
int axis_vx
 
int axis_vy
 
geometry_msgs::Twist cmd
 
bool deadman_
 
int deadman_button
 
bool deadman_no_publish_
 
ros::Duration joy_msg_timeout_
 
ros::Subscriber joy_sub_
 
ros::Time last_recieved_joy_message_time_
 
double max_vw
 
double max_vw_run
 
double max_vx
 
double max_vx_run
 
double max_vy
 
double max_vy_run
 
ros::NodeHandle n_
 
geometry_msgs::Twist passthrough_cmd
 
ros::Subscriber passthrough_sub_
 
double req_vw
 
double req_vx
 
double req_vy
 
int run_button
 
bool running_
 
ros::Publisher vel_pub_
 

Detailed Description

Definition at line 58 of file p2os_teleop.cc.

Constructor & Destructor Documentation

TeleopBase::TeleopBase ( bool  deadman_no_publish = false)
inline

Constructor for the teleop base

Definition at line 78 of file p2os_teleop.cc.

TeleopBase::~TeleopBase ( )
inline

Definition at line 145 of file p2os_teleop.cc.

Member Function Documentation

void TeleopBase::init ( )
inline

Definition at line 89 of file p2os_teleop.cc.

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

Definition at line 153 of file p2os_teleop.cc.

void TeleopBase::passthrough_cb ( const geometry_msgs::TwistConstPtr &  pass_msg)
inline

Definition at line 147 of file p2os_teleop.cc.

void TeleopBase::send_cmd_vel ( )
inline

Definition at line 185 of file p2os_teleop.cc.

Member Data Documentation

int TeleopBase::axis_vw

Definition at line 64 of file p2os_teleop.cc.

int TeleopBase::axis_vx

Definition at line 64 of file p2os_teleop.cc.

int TeleopBase::axis_vy

Definition at line 64 of file p2os_teleop.cc.

geometry_msgs::Twist TeleopBase::cmd

Definition at line 61 of file p2os_teleop.cc.

bool TeleopBase::deadman_

Definition at line 67 of file p2os_teleop.cc.

int TeleopBase::deadman_button

Definition at line 65 of file p2os_teleop.cc.

bool TeleopBase::deadman_no_publish_

Definition at line 66 of file p2os_teleop.cc.

ros::Duration TeleopBase::joy_msg_timeout_

Definition at line 71 of file p2os_teleop.cc.

ros::Subscriber TeleopBase::joy_sub_

Definition at line 75 of file p2os_teleop.cc.

ros::Time TeleopBase::last_recieved_joy_message_time_

Definition at line 70 of file p2os_teleop.cc.

double TeleopBase::max_vw

Definition at line 63 of file p2os_teleop.cc.

double TeleopBase::max_vw_run

Definition at line 63 of file p2os_teleop.cc.

double TeleopBase::max_vx

Definition at line 63 of file p2os_teleop.cc.

double TeleopBase::max_vx_run

Definition at line 63 of file p2os_teleop.cc.

double TeleopBase::max_vy

Definition at line 63 of file p2os_teleop.cc.

double TeleopBase::max_vy_run

Definition at line 63 of file p2os_teleop.cc.

ros::NodeHandle TeleopBase::n_

Definition at line 73 of file p2os_teleop.cc.

geometry_msgs::Twist TeleopBase::passthrough_cmd

Definition at line 61 of file p2os_teleop.cc.

ros::Subscriber TeleopBase::passthrough_sub_

Definition at line 76 of file p2os_teleop.cc.

double TeleopBase::req_vw

Definition at line 62 of file p2os_teleop.cc.

double TeleopBase::req_vx

Definition at line 62 of file p2os_teleop.cc.

double TeleopBase::req_vy

Definition at line 62 of file p2os_teleop.cc.

int TeleopBase::run_button

Definition at line 65 of file p2os_teleop.cc.

bool TeleopBase::running_

Definition at line 68 of file p2os_teleop.cc.

ros::Publisher TeleopBase::vel_pub_

Definition at line 74 of file p2os_teleop.cc.


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


p2os_teleop
Author(s): Hunter L. Allen , David Feil-Seifer , Brian Gerkey, Kasper Stoy, Richard Vaughan, Andrew Howard, Tucker Hermans, ActivMedia Robotics LLC, MobileRobots Inc.
autogenerated on Sat Jun 20 2020 03:29:45