pcan_transmit.h
Go to the documentation of this file.
00001 // INCLUDE
00002 
00003 #include <stdio.h>
00004 #include <stdlib.h>
00005 #include <errno.h>
00006 #include <unistd.h>   // exit
00007 #include <signal.h>
00008 #include <string.h>
00009 #include <stdlib.h>   // strtoul
00010 #include <fcntl.h>    // O_RDWR
00011 #include "common.h"
00012 #include <ctype.h>
00013 #include "ros/ros.h"
00014 #include "std_msgs/String.h"
00015 #include <sstream>
00016 
00017 // DEFINES
00018 
00019 #define DEFAULT_NODE "/dev/pcan32"
00020 
00021 
00022 class pcan_transmit
00023 {
00024 protected:
00025         HANDLE h;
00026         ros::NodeHandle n;
00027         ros::Subscriber pcan_sub;
00028         std_msgs::String msg;
00029         std::stringstream ss;
00030 public:
00031         pcan_transmit();
00032         void hlpMsg();
00033         void init(int argc, char **argv);
00034         void transmit(const std_msgs::String can_message);
00035         TPCANMsg StringToTPCANRdMsg(std_msgs::String msg);
00036 };


pcan_topics
Author(s):
autogenerated on Thu Jun 6 2019 17:40:04