laser_scan_publisher.cpp
Go to the documentation of this file.
2 
3 #include "pf_driver/PFR2000Header.h"
4 
5 LaserscanPublisher::LaserscanPublisher(std::shared_ptr<ScanConfig> config, std::shared_ptr<ScanParameters> params,
6  const std::string& scan_topic, const std::string& frame_id)
7  : PFDataPublisher(config, params)
8 {
9  scan_publisher_ = nh_.advertise<sensor_msgs::LaserScan>(scan_topic, 1);
10  header_publisher_ = nh_.advertise<pf_driver::PFR2000Header>("/r2000_header", 1);
11  frame_id_ = frame_id;
12 }
13 
14 void LaserscanPublisher::handle_scan(sensor_msgs::LaserScanPtr msg, uint16_t layer_idx, int layer_inclination,
15  bool apply_correction)
16 {
17  publish_scan(msg);
18 }
19 
20 void LaserscanPublisher::publish_scan(sensor_msgs::LaserScanPtr msg)
21 {
23 }
std::string frame_id_
ros::Publisher scan_publisher_
ros::Publisher header_publisher_
virtual void handle_scan(sensor_msgs::LaserScanPtr msg, uint16_t layer_idx, int layer_inclination, bool apply_correction)
void publish(const boost::shared_ptr< M > &message) const
LaserscanPublisher(std::shared_ptr< ScanConfig > config, std::shared_ptr< ScanParameters > params, const std::string &scan_topic, const std::string &frame_id)
ros::NodeHandle nh_
Publisher advertise(const std::string &topic, uint32_t queue_size, bool latch=false)
void publish_scan(sensor_msgs::LaserScanPtr msg)


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