35 #ifndef CANEXTRACTOR_H_ 36 #define CANEXTRACTOR_H_ 42 #include <std_msgs/Bool.h> 43 #include <std_msgs/UInt8.h> 44 #include <std_msgs/UInt16.h> 45 #include <std_msgs/UInt32.h> 46 #include <std_msgs/UInt64.h> 47 #include <std_msgs/Int8.h> 48 #include <std_msgs/Int16.h> 49 #include <std_msgs/Int32.h> 50 #include <std_msgs/Int64.h> 51 #include <std_msgs/Float64.h> 53 #include <can_msgs/Frame.h> 78 std::vector<RosCanSigStruct>
sigs;
83 CanExtractor(
const std::string &dbc_file,
bool offline,
bool expand =
true,
bool unknown =
false);
84 CanExtractor(
const std::vector<std::string> &dbc_file,
bool offline,
bool expand =
true,
bool unknown =
false);
114 std::map<uint32_t, RosCanMsgStruct>
msgs_;