Public Member Functions | Protected Member Functions | Protected Attributes | List of all members
SickScanMessageReceiver Class Reference

Public Member Functions

 SickScanMessageReceiver (rclcpp::Node::SharedPtr node=0, const std::string &cloud_topic="cloud", const std::string &lferec_topic="lferec", const std::string &lidoutputstate_topic="lidoutputstate")
 

Protected Member Functions

void messageCbLFErecROS2 (const std::shared_ptr< sick_scan_xd::msg::LFErecMsg > msg)
 
void messageCbLIDoutputstateROS2 (const std::shared_ptr< sick_scan_xd::msg::LIDoutputstateMsg > msg)
 
void messageCbPointCloudROS2 (const std::shared_ptr< sensor_msgs::msg::PointCloud2 > msg)
 

Protected Attributes

rclcpp::Subscription< sick_scan_xd::msg::LFErecMsg >::SharedPtr m_lferec_subscriber
 
rclcpp::Subscription< sick_scan_xd::msg::LIDoutputstateMsg >::SharedPtr m_lidoutputstate_subscriber
 
rclcpp::Subscription< sensor_msgs::msg::PointCloud2 >::SharedPtr m_pointcloud_subscriber
 

Detailed Description

Definition at line 77 of file sick_scan_ros2_example.cpp.

Constructor & Destructor Documentation

◆ SickScanMessageReceiver()

SickScanMessageReceiver::SickScanMessageReceiver ( rclcpp::Node::SharedPtr  node = 0,
const std::string &  cloud_topic = "cloud",
const std::string &  lferec_topic = "lferec",
const std::string &  lidoutputstate_topic = "lidoutputstate" 
)
inline

Constructor

Definition at line 81 of file sick_scan_ros2_example.cpp.

Member Function Documentation

◆ messageCbLFErecROS2()

void SickScanMessageReceiver::messageCbLFErecROS2 ( const std::shared_ptr< sick_scan_xd::msg::LFErecMsg >  msg)
inlineprotected

ROS2-callback for sick_scan lferec messages

Definition at line 99 of file sick_scan_ros2_example.cpp.

◆ messageCbLIDoutputstateROS2()

void SickScanMessageReceiver::messageCbLIDoutputstateROS2 ( const std::shared_ptr< sick_scan_xd::msg::LIDoutputstateMsg >  msg)
inlineprotected

ROS2-callback for sick_scan lidoutputstate messages

Definition at line 105 of file sick_scan_ros2_example.cpp.

◆ messageCbPointCloudROS2()

void SickScanMessageReceiver::messageCbPointCloudROS2 ( const std::shared_ptr< sensor_msgs::msg::PointCloud2 >  msg)
inlineprotected

ROS2-callback for point cloud messages

Definition at line 93 of file sick_scan_ros2_example.cpp.

Member Data Documentation

◆ m_lferec_subscriber

rclcpp::Subscription<sick_scan_xd::msg::LFErecMsg>::SharedPtr SickScanMessageReceiver::m_lferec_subscriber
protected

Definition at line 112 of file sick_scan_ros2_example.cpp.

◆ m_lidoutputstate_subscriber

rclcpp::Subscription<sick_scan_xd::msg::LIDoutputstateMsg>::SharedPtr SickScanMessageReceiver::m_lidoutputstate_subscriber
protected

Definition at line 113 of file sick_scan_ros2_example.cpp.

◆ m_pointcloud_subscriber

rclcpp::Subscription<sensor_msgs::msg::PointCloud2>::SharedPtr SickScanMessageReceiver::m_pointcloud_subscriber
protected

Subscriber of pointcloud and sick_scan messages

Definition at line 111 of file sick_scan_ros2_example.cpp.


The documentation for this class was generated from the following file:


sick_scan_xd
Author(s): Michael Lehning , Jochen Sprickerhof , Martin Günther
autogenerated on Fri Oct 25 2024 02:47:14