Class SocketCANInterface

Class Documentation

class SocketCANInterface

Public Functions

SocketCANInterface(const std::string &canbus, std::shared_ptr<rclcpp::Node> &nh)
SocketCANInterface(const std::string &canbus, std::shared_ptr<rclcpp::Node> &nh, std::function<void(const can_msgs::msg::Frame::SharedPtr msg)> cb)
bool recv(can_msgs::msg::Frame::SharedPtr msg)
void send(can_msgs::msg::Frame msg)
void queue(can_msgs::msg::Frame msg)
void startSendTimer(uint16_t period_ms)
void stopSendTimer()