#include <ros/ros.h>#include <string>#include <vector>#include <set>#include <limits>#include <iostream>#include <sstream>#include <std_msgs/Float32.h>#include <std_msgs/Float64.h>#include <std_msgs/Int8.h>#include <std_msgs/Int16.h>#include <std_msgs/Int32.h>#include <std_msgs/Int64.h>#include <std_msgs/UInt8.h>#include <std_msgs/UInt16.h>#include <std_msgs/UInt32.h>#include <std_msgs/UInt64.h>#include <std_msgs/Bool.h>#include <boost/algorithm/string.hpp>#include <sensor_msgs/Joy.h>#include <x52_joyext/x52_mfd.h>
Go to the source code of this file.
| Classes | |
| class | PublishMFD< T >::PairSortMod | 
| class | PublishMFD< T > | 
| Defines | |
| #define | casem(CASE, TYPE, TYPEROS) | 
| Enumerations | |
| enum | { INPUT_FLOAT32 = 0, INPUT_FLOAT64, INPUT_INT8, INPUT_INT16, INPUT_INT32, INPUT_INT64, INPUT_UINT8, INPUT_UINT16, INPUT_UINT32, INPUT_UINT64, INPUT_BOOL, INPUT_JOY } | 
| Functions | |
| int | main (int argc, char **argv) | 
| #define casem | ( | CASE, | |
| TYPE, | |||
| TYPEROS | |||
| ) | 
case CASE:\
        {\
                PublishMFD< TYPE > obj(&n);\
                obj.start<std_msgs::TYPEROS, std_msgs:: TYPEROS## ConstPtr>();\
                break;\
        }\
| anonymous enum | 
| INPUT_FLOAT32 | |
| INPUT_FLOAT64 | |
| INPUT_INT8 | |
| INPUT_INT16 | |
| INPUT_INT32 | |
| INPUT_INT64 | |
| INPUT_UINT8 | |
| INPUT_UINT16 | |
| INPUT_UINT32 | |
| INPUT_UINT64 | |
| INPUT_BOOL | |
| INPUT_JOY | 
Definition at line 168 of file mfd_writer.cpp.
| int main | ( | int | argc, | 
| char ** | argv | ||
| ) | 
The main function
| argc | Size of Arguments supplied | 
| argv | Argument list | 
< The input type
Definition at line 520 of file mfd_writer.cpp.