Class OusterSensorNodeBase

Inheritance Relationships

Base Type

  • public rclcpp_lifecycle::LifecycleNode

Class Documentation

class OusterSensorNodeBase : public rclcpp_lifecycle::LifecycleNode

Protected Functions

inline explicit OusterSensorNodeBase(const std::string &name, const rclcpp::NodeOptions &options)
inline bool is_arg_set(const std::string &arg) const
void create_get_metadata_service()
void create_metadata_publisher()
void publish_metadata()
void display_lidar_info(const ouster::sensor::sensor_info &info)

Protected Attributes

ouster::sensor::sensor_info info
rclcpp::Service<ouster_sensor_msgs::srv::GetMetadata>::SharedPtr get_metadata_srv
std::string cached_metadata
rclcpp::Publisher<std_msgs::msg::String>::SharedPtr metadata_pub

Protected Static Functions

static std::string read_text_file(const std::string &text_file)
static bool write_text_to_file(const std::string &file_path, const std::string &text)