#include <ps3.h>
Public Member Functions | |
void | CallbackJoy (const sensor_msgs::Joy::ConstPtr &joy_msg) |
void | CallRGBService () |
IMJoystick () | |
void | init () |
void | PublishVel () |
void | TurnOffRGB () |
~IMJoystick () | |
Public Attributes | |
ros::ServiceClient | client |
geometry_msgs::Twist | cmd |
double | d_timeout |
bool | deadman |
ros::Subscriber | joy_sub_ |
double | max_ang |
double | max_lin |
double | max_x |
double | max_z |
ros::NodeHandle | n |
ros::Publisher | vel_pub |
Private Member Functions | |
void | CheckTimeout () |
Private Attributes | |
int | axl_leftwards |
int | axl_upwards |
int | axr_leftwards |
int | axr_upwards |
int | circle_button |
int | cross_button |
int | deadman_button |
ros::Time | last_time |
int | square_button |
int | triangle_button |
geometry_msgs::Twist | vel_msg |
IMJoystick::~IMJoystick | ( | ) | [inline] |
void IMJoystick::CallbackJoy | ( | const sensor_msgs::Joy::ConstPtr & | joy_msg | ) |
void IMJoystick::CallRGBService | ( | ) |
void IMJoystick::CheckTimeout | ( | ) | [private] |
void IMJoystick::init | ( | ) |
void IMJoystick::PublishVel | ( | ) |
void IMJoystick::TurnOffRGB | ( | ) |
int IMJoystick::axl_leftwards [private] |
int IMJoystick::axl_upwards [private] |
int IMJoystick::axr_leftwards [private] |
int IMJoystick::axr_upwards [private] |
int IMJoystick::circle_button [private] |
geometry_msgs::Twist IMJoystick::cmd |
int IMJoystick::cross_button [private] |
double IMJoystick::d_timeout |
bool IMJoystick::deadman |
int IMJoystick::deadman_button [private] |
ros::Time IMJoystick::last_time [private] |
double IMJoystick::max_ang |
double IMJoystick::max_lin |
double IMJoystick::max_x |
double IMJoystick::max_z |
int IMJoystick::square_button [private] |
int IMJoystick::triangle_button [private] |
geometry_msgs::Twist IMJoystick::vel_msg [private] |