Main Page
Classes
Files
File List
File Members
src
pcan_receive.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
18
class
pcan_receive
19
{
20
protected
:
21
HANDLE
h
;
22
ros::NodeHandle
n
;
23
ros::Publisher
pcan_pub
;
24
std_msgs::String
msg
;
25
std::stringstream
ss
;
26
public
:
27
pcan_receive
();
28
void
hlpMsg
();
29
void
init
(
int
argc,
char
**argv);
30
void
receive
();
31
std_msgs::String
TPCANRdMsgToString
(TPCANRdMsg m);
32
33
34
};
pcan_receive::msg
std_msgs::String msg
Definition:
pcan_receive.h:24
pcan_receive::init
void init(int argc, char **argv)
Definition:
pcan_receive.cpp:64
pcan_receive::pcan_receive
pcan_receive()
Definition:
pcan_receive.cpp:50
pcan_receive::receive
void receive()
Definition:
pcan_receive.cpp:175
pcan_receive
Definition:
pcan_receive.h:18
pcan_receive::pcan_pub
ros::Publisher pcan_pub
Definition:
pcan_receive.h:23
pcan_receive::n
ros::NodeHandle n
Definition:
pcan_receive.h:22
pcan_receive::ss
std::stringstream ss
Definition:
pcan_receive.h:25
pcan_receive::TPCANRdMsgToString
std_msgs::String TPCANRdMsgToString(TPCANRdMsg m)
Definition:
pcan_receive.cpp:216
common.h
pcan_receive::hlpMsg
void hlpMsg()
Definition:
pcan_receive.cpp:22
pcan_receive::h
HANDLE h
Definition:
pcan_receive.h:21
pcan_topics
Author(s):
autogenerated on Sun Dec 14 2014 19:01:10