Go to the documentation of this file.
35 #ifndef _DATASPEED_CAN_USB_CAN_DRIVER_H_
36 #define _DATASPEED_CAN_USB_CAN_DRIVER_H_
41 #include <can_msgs/Frame.h>
44 #include <boost/thread/mutex.hpp>
45 #include <boost/thread/lock_guard.hpp>
63 const std::string &name = std::string(
"Dataspeed USB CAN Tool"),
70 void recvRos(
const can_msgs::Frame::ConstPtr& msg,
unsigned int channel);
72 void recvDevice(
unsigned int channel, uint32_t
id,
bool extended, uint8_t dlc,
const uint8_t data[8]);
76 return ros::WallTime(dev_stamp / 1000000, (dev_stamp % 1000000) * 1000);
129 #endif // _DATASPEED_CAN_USB_CAN_DRIVER_H_
void timerServiceCallback(const ros::WallTimerEvent &event)
bool sampleTimeOffset(ros::WallDuration &offset, ros::WallDuration &delay)
void recvRos(const can_msgs::Frame::ConstPtr &msg, unsigned int channel)
void recvDevice(unsigned int channel, uint32_t id, bool extended, uint8_t dlc, const uint8_t data[8])
ros::Publisher pub_version_
std::vector< ros::Subscriber > subs_
CanDriver(ros::NodeHandle &nh, ros::NodeHandle &nh_priv, lusb::UsbDevice *dev=NULL, const std::string &name=std::string("Dataspeed USB CAN Tool"), const ModuleVersion &firmware=ModuleVersion(10, 4, 0))
ros::WallTime stampDev2Ros(unsigned int dev_stamp)
std::vector< ros::Publisher > pubs_
std::vector< Filter > filters
std::vector< Channel > channels_
ros::WallTimer timer_service_
std::vector< ros::Publisher > pubs_err_
void timerFlushCallback(const ros::WallTimerEvent &event)
ros::WallTimer timer_flush_
dataspeed_can_usb
Author(s): Kevin Hallenbeck
autogenerated on Sat Feb 4 2023 03:39:26