| Public Member Functions | |
| Teleoperator () | |
| Private Member Functions | |
| void | joyCB (const sensor_msgs::Joy::ConstPtr &msg) | 
| Private Attributes | |
| int | mAxisDirection | 
| int | mAxisVelocity | 
| int | mButtonDriveMode | 
| int | mButtonGetMap | 
| int | mButtonPauseNavigator | 
| bool | mButtonPressed | 
| int | mButtonStartExploration | 
| int | mButtonStop | 
| ros::Publisher | mCommandPublisher | 
| ros::ServiceClient | mExploreClient | 
| ros::ServiceClient | mGetMapClient | 
| ros::Subscriber | mJoySubscriber | 
| ros::ServiceClient | mNavigatorClient | 
| ros::NodeHandle | mNode | 
Definition at line 23 of file remote_joy.cpp.
Definition at line 49 of file remote_joy.cpp.
| void Teleoperator::joyCB | ( | const sensor_msgs::Joy::ConstPtr & | msg | ) |  [private] | 
Definition at line 70 of file remote_joy.cpp.
| int Teleoperator::mAxisDirection  [private] | 
Definition at line 39 of file remote_joy.cpp.
| int Teleoperator::mAxisVelocity  [private] | 
Definition at line 38 of file remote_joy.cpp.
| int Teleoperator::mButtonDriveMode  [private] | 
Definition at line 40 of file remote_joy.cpp.
| int Teleoperator::mButtonGetMap  [private] | 
Definition at line 43 of file remote_joy.cpp.
| int Teleoperator::mButtonPauseNavigator  [private] | 
Definition at line 41 of file remote_joy.cpp.
| bool Teleoperator::mButtonPressed  [private] | 
Definition at line 46 of file remote_joy.cpp.
| int Teleoperator::mButtonStartExploration  [private] | 
Definition at line 42 of file remote_joy.cpp.
| int Teleoperator::mButtonStop  [private] | 
Definition at line 44 of file remote_joy.cpp.
Definition at line 32 of file remote_joy.cpp.
Definition at line 35 of file remote_joy.cpp.
Definition at line 36 of file remote_joy.cpp.
| ros::Subscriber Teleoperator::mJoySubscriber  [private] | 
Definition at line 33 of file remote_joy.cpp.
Definition at line 34 of file remote_joy.cpp.
| ros::NodeHandle Teleoperator::mNode  [private] | 
Definition at line 31 of file remote_joy.cpp.