Class Sensor

Class Documentation

class Sensor

Public Functions

Sensor() = default
explicit Sensor(std::unique_ptr<SensorInterface> impl)
explicit Sensor(Sensor &&other) noexcept
~Sensor() = default
const rclcpp_lifecycle::State &initialize(const HardwareInfo &sensor_info, rclcpp::Logger logger, rclcpp::node_interfaces::NodeClockInterface::SharedPtr clock_interface)
const rclcpp_lifecycle::State &configure()
const rclcpp_lifecycle::State &cleanup()
const rclcpp_lifecycle::State &shutdown()
const rclcpp_lifecycle::State &activate()
const rclcpp_lifecycle::State &deactivate()
const rclcpp_lifecycle::State &error()
std::vector<StateInterface::ConstSharedPtr> export_state_interfaces()
std::string get_name() const
std::string get_group_name() const
const rclcpp_lifecycle::State &get_lifecycle_state() const
const rclcpp::Time &get_last_read_time() const
return_type read(const rclcpp::Time &time, const rclcpp::Duration &period)
inline return_type write(const rclcpp::Time&, const rclcpp::Duration&)
std::recursive_mutex &get_mutex()