| Classes | |
| class | PairSortMod | 
| Public Member Functions | |
| template<class MSGPTR > | |
| void | Callback (const MSGPTR &msg) | 
| void | JoyCallback (const sensor_msgs::JoyConstPtr &msg) | 
| void | progressValue (T value) | 
| PublishLED (ros::NodeHandle *n, std::string setup, int led, int axis, bool axis_or_button) | |
| template<class MSG , class MSGPTR > | |
| void | start () | 
| void | startJoy () | 
| ~PublishLED () | |
| Private Types | |
| enum | { OFF = 'O', GREEN = 'G', YELLOW = 'Y', RED = 'R' } | 
| Private Attributes | |
| int | axis_button | 
| bool | axis_or_button | 
| int | led | 
| ros::NodeHandle * | n | 
| ros::Publisher | pub | 
| std::set< PairSortMod > | ranges | 
| ros::Subscriber | sub | 
Definition at line 155 of file value2buttonColor.cpp.
| anonymous enum  [private] | 
Definition at line 157 of file value2buttonColor.cpp.
| PublishLED< T >::PublishLED | ( | ros::NodeHandle * | n, | 
| std::string | setup, | ||
| int | led, | ||
| int | axis, | ||
| bool | axis_or_button | ||
| ) |  [inline] | 
Definition at line 185 of file value2buttonColor.cpp.
| PublishLED< T >::~PublishLED | ( | ) |  [inline] | 
Definition at line 263 of file value2buttonColor.cpp.
| void PublishLED< T >::Callback | ( | const MSGPTR & | msg | ) |  [inline] | 
Definition at line 307 of file value2buttonColor.cpp.
| void PublishLED< T >::JoyCallback | ( | const sensor_msgs::JoyConstPtr & | msg | ) |  [inline] | 
Definition at line 280 of file value2buttonColor.cpp.
| void PublishLED< T >::progressValue | ( | T | value | ) |  [inline] | 
Definition at line 266 of file value2buttonColor.cpp.
Definition at line 315 of file value2buttonColor.cpp.
| void PublishLED< T >::startJoy | ( | ) |  [inline] | 
Definition at line 321 of file value2buttonColor.cpp.
| int PublishLED< T >::axis_button  [private] | 
Definition at line 180 of file value2buttonColor.cpp.
| bool PublishLED< T >::axis_or_button  [private] | 
Definition at line 179 of file value2buttonColor.cpp.
| int PublishLED< T >::led  [private] | 
Definition at line 178 of file value2buttonColor.cpp.
| ros::NodeHandle* PublishLED< T >::n  [private] | 
Definition at line 176 of file value2buttonColor.cpp.
| ros::Publisher PublishLED< T >::pub  [private] | 
Definition at line 177 of file value2buttonColor.cpp.
| std::set< PairSortMod > PublishLED< T >::ranges  [private] | 
Definition at line 175 of file value2buttonColor.cpp.
| ros::Subscriber PublishLED< T >::sub  [private] | 
Definition at line 181 of file value2buttonColor.cpp.