Class Sender

Inheritance Relationships

Base Type

  • public off_highway_can::Sender

Class Documentation

class Sender : public off_highway_can::Sender

Uss sender class to encode CAN frames. Encodes temperature input as CAN frame.

Public Types

using UssInput = sensor_msgs::msg::Temperature

Public Functions

explicit Sender(const rclcpp::NodeOptions &options = rclcpp::NodeOptions())

Construct a new Sender object.

~Sender() = default

Destroy the Receiver object.

Protected Functions

void callback_input(const UssInput::ConstSharedPtr &msg)

Map received data to message signals, encode the messages and send them as CAN frame.

Parameters:

msg – Received message data

void fillMessageDefinitions()

Fill message definitions to encode frames of CAN node. Only stored definitions are sent.

void declare_and_get_parameters()

Declare and get node parameters.

Protected Attributes

rclcpp::Subscription<UssInput>::SharedPtr input_sub_
uint32_t outside_temperature_id_
double allowed_age_

Allowed age of input message to process.