#include <REL_Linux_SUSI.h>#include <diagnostic_msgs/DiagnosticStatus.h>#include <std_msgs/UInt16.h>#include <ros/ros.h>#include <boost/bind.hpp>
Go to the source code of this file.
Classes | |
| struct | SharedData |
Functions | |
| void | getTemperature (SharedData &shared) |
| void | handleGPIO (SharedData &shared, const std_msgs::UInt16::ConstPtr &data) |
| int | init_susi (SharedData &shared) |
| int | main (int argc, char *argv[]) |
| void getTemperature | ( | SharedData & | shared | ) |
Definition at line 95 of file advantech_node.cpp.
| void handleGPIO | ( | SharedData & | shared, |
| const std_msgs::UInt16::ConstPtr & | data | ||
| ) |
Definition at line 111 of file advantech_node.cpp.
| int init_susi | ( | SharedData & | shared | ) |
Definition at line 56 of file advantech_node.cpp.
| int main | ( | int | argc, |
| char * | argv[] | ||
| ) |
Definition at line 126 of file advantech_node.cpp.