pcan_transmit.h
Go to the documentation of this file.
1 // INCLUDE
2 
3 #include <stdio.h>
4 #include <stdlib.h>
5 #include <errno.h>
6 #include <unistd.h> // exit
7 #include <signal.h>
8 #include <string.h>
9 #include <stdlib.h> // strtoul
10 #include <fcntl.h> // O_RDWR
11 #include "common.h"
12 #include <ctype.h>
13 #include "ros/ros.h"
14 #include "std_msgs/String.h"
15 #include <sstream>
16 
17 // DEFINES
18 
19 #define DEFAULT_NODE "/dev/pcan32"
20 
21 
23 {
24 protected:
25  HANDLE h;
26  ros::NodeHandle n;
27  ros::Subscriber pcan_sub;
28  std_msgs::String msg;
29  std::stringstream ss;
30 public:
31  pcan_transmit();
32  void hlpMsg();
33  void init(int argc, char **argv);
34  void transmit(const std_msgs::String can_message);
35  TPCANMsg StringToTPCANRdMsg(std_msgs::String msg);
36 };
std::stringstream ss
Definition: pcan_transmit.h:29
TPCANMsg StringToTPCANRdMsg(std_msgs::String msg)
ros::Subscriber pcan_sub
Definition: pcan_transmit.h:27
ros::NodeHandle n
Definition: pcan_transmit.h:26
std_msgs::String msg
Definition: pcan_transmit.h:28
void init(int argc, char **argv)
void transmit(const std_msgs::String can_message)


pcan_topics
Author(s):
autogenerated on Sun Dec 14 2014 19:01:10