|
| SickScanMessageReceiver (rclcpp::Node::SharedPtr node=0, const std::string &cloud_topic="cloud", const std::string &lferec_topic="lferec", const std::string &lidoutputstate_topic="lidoutputstate") |
|
Definition at line 77 of file sick_scan_ros2_example.cpp.
◆ 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 |
◆ messageCbLFErecROS2()
void SickScanMessageReceiver::messageCbLFErecROS2 |
( |
const std::shared_ptr< sick_scan_xd::msg::LFErecMsg > |
msg | ) |
|
|
inlineprotected |
◆ messageCbLIDoutputstateROS2()
void SickScanMessageReceiver::messageCbLIDoutputstateROS2 |
( |
const std::shared_ptr< sick_scan_xd::msg::LIDoutputstateMsg > |
msg | ) |
|
|
inlineprotected |
◆ messageCbPointCloudROS2()
void SickScanMessageReceiver::messageCbPointCloudROS2 |
( |
const std::shared_ptr< sensor_msgs::msg::PointCloud2 > |
msg | ) |
|
|
inlineprotected |
◆ m_lferec_subscriber
rclcpp::Subscription<sick_scan_xd::msg::LFErecMsg>::SharedPtr SickScanMessageReceiver::m_lferec_subscriber |
|
protected |
◆ m_lidoutputstate_subscriber
rclcpp::Subscription<sick_scan_xd::msg::LIDoutputstateMsg>::SharedPtr SickScanMessageReceiver::m_lidoutputstate_subscriber |
|
protected |
◆ m_pointcloud_subscriber
rclcpp::Subscription<sensor_msgs::msg::PointCloud2>::SharedPtr SickScanMessageReceiver::m_pointcloud_subscriber |
|
protected |
The documentation for this class was generated from the following file: