Public Member Functions | |
Joy2twist (int argc, char **argv) | |
Joy2twist (int argc, char **argv) | |
void | joyCallback (const sensor_msgs::Joy::ConstPtr &msg) |
void | joyCallback (const sensor_msgs::Joy::ConstPtr &msg) |
void | twistBiclopsCallback (const geometry_msgs::Twist::ConstPtr &msg) |
void | twistCallback (const geometry_msgs::Twist::ConstPtr &msg) |
void | twistPioneerCallback (const geometry_msgs::Twist::ConstPtr &msg) |
virtual | ~Joy2twist () |
virtual | ~Joy2twist () |
Private Attributes | |
geometry_msgs::Twist | in_biclops_cmd_vel_ |
geometry_msgs::Twist | in_cmd_vel_ |
geometry_msgs::Twist | in_pioneer_cmd_vel_ |
bool | joystrick_drive_ |
ros::NodeHandle | nh_ |
ros::Publisher | pubTwist_ |
ros::Publisher | pubTwistBiclops_ |
ros::Publisher | pubTwistPioneer_ |
ros::Subscriber | subJoy_ |
ros::Subscriber | subTwist_ |
ros::Subscriber | subTwistBiclops_ |
ros::Subscriber | subTwistPioneer_ |
Definition at line 6 of file joy2twist_pioneer.cpp.
Joy2twist::Joy2twist | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 25 of file joy2twist_pioneer.cpp.
virtual Joy2twist::~Joy2twist | ( | ) | [inline, virtual] |
Definition at line 22 of file joy2twist_pioneer.cpp.
Joy2twist::Joy2twist | ( | int | argc, |
char ** | argv | ||
) |
virtual Joy2twist::~Joy2twist | ( | ) | [inline, virtual] |
Definition at line 27 of file joy2twist_pioneer_pan.cpp.
void Joy2twist::joyCallback | ( | const sensor_msgs::Joy::ConstPtr & | msg | ) |
Definition at line 33 of file joy2twist_pioneer.cpp.
void Joy2twist::joyCallback | ( | const sensor_msgs::Joy::ConstPtr & | msg | ) |
void Joy2twist::twistBiclopsCallback | ( | const geometry_msgs::Twist::ConstPtr & | msg | ) |
Definition at line 94 of file joy2twist_pioneer_pan.cpp.
void Joy2twist::twistCallback | ( | const geometry_msgs::Twist::ConstPtr & | msg | ) |
Definition at line 70 of file joy2twist_pioneer.cpp.
void Joy2twist::twistPioneerCallback | ( | const geometry_msgs::Twist::ConstPtr & | msg | ) |
Definition at line 82 of file joy2twist_pioneer_pan.cpp.
geometry_msgs::Twist Joy2twist::in_biclops_cmd_vel_ [private] |
Definition at line 18 of file joy2twist_pioneer_pan.cpp.
geometry_msgs::Twist Joy2twist::in_cmd_vel_ [private] |
Definition at line 14 of file joy2twist_pioneer.cpp.
geometry_msgs::Twist Joy2twist::in_pioneer_cmd_vel_ [private] |
Definition at line 17 of file joy2twist_pioneer_pan.cpp.
bool Joy2twist::joystrick_drive_ [private] |
Definition at line 16 of file joy2twist_pioneer.cpp.
ros::NodeHandle Joy2twist::nh_ [private] |
Definition at line 9 of file joy2twist_pioneer.cpp.
ros::Publisher Joy2twist::pubTwist_ [private] |
Definition at line 10 of file joy2twist_pioneer.cpp.
ros::Publisher Joy2twist::pubTwistBiclops_ [private] |
Definition at line 12 of file joy2twist_pioneer_pan.cpp.
ros::Publisher Joy2twist::pubTwistPioneer_ [private] |
Definition at line 11 of file joy2twist_pioneer_pan.cpp.
ros::Subscriber Joy2twist::subJoy_ [private] |
Definition at line 11 of file joy2twist_pioneer.cpp.
ros::Subscriber Joy2twist::subTwist_ [private] |
Definition at line 12 of file joy2twist_pioneer.cpp.
ros::Subscriber Joy2twist::subTwistBiclops_ [private] |
Definition at line 15 of file joy2twist_pioneer_pan.cpp.
ros::Subscriber Joy2twist::subTwistPioneer_ [private] |
Definition at line 14 of file joy2twist_pioneer_pan.cpp.