laser_scan_publisher.h
Go to the documentation of this file.
1 #pragma once
2 
4 
6 {
7 public:
8  LaserscanPublisher(std::shared_ptr<ScanConfig> config, std::shared_ptr<ScanParameters> params,
9  const std::string& scan_topic, const std::string& frame_id);
10 
11 private:
13 
14  virtual void handle_scan(sensor_msgs::LaserScanPtr msg, uint16_t layer_idx, int layer_inclination,
15  bool apply_correction);
16 
17  void publish_scan(sensor_msgs::LaserScanPtr msg);
18 };
ros::Publisher scan_publisher_
config
virtual void handle_scan(sensor_msgs::LaserScanPtr msg, uint16_t layer_idx, int layer_inclination, bool apply_correction)
LaserscanPublisher(std::shared_ptr< ScanConfig > config, std::shared_ptr< ScanParameters > params, const std::string &scan_topic, const std::string &frame_id)
void publish_scan(sensor_msgs::LaserScanPtr msg)


pf_driver
Author(s): Harsh Deshpande
autogenerated on Fri Feb 24 2023 03:59:35