16 #ifndef PSEN_SCAN_ROS_SCANNER_NODE_H 17 #define PSEN_SCAN_ROS_SCANNER_NODE_H 20 #include <sensor_msgs/LaserScan.h> 34 const std::string& topic,
35 const std::string& frame_id,
37 const Degree& x_axis_rotation,
38 std::unique_ptr<vScanner> scanner);
52 #endif // PSEN_SCAN_ROS_SCANNER_NODE_H
Class implements a ROS-Node for the PSENscan safety laser scanner.
Class to model angles in degrees from user's perspective.
Class to hold the data for one laserscan without depencies to ROS.
struct psen_scan::LaserScan LaserScan
Class to hold the data for one laserscan without depencies to ROS.
sensor_msgs::LaserScan buildRosMessage(const LaserScan &laserscan)
Creates a ROS message from an LaserScan, which contains one scanning round.
ROSScannerNode(ros::NodeHandle &nh, const std::string &topic, const std::string &frame_id, const uint16_t &skip, const Degree &x_axis_rotation, std::unique_ptr< vScanner > scanner)
Construct a new ROSScannerNode::ROSScannerNode object.
void processingLoop()
endless loop for processing incoming UDP data from the laser scanner
std::unique_ptr< vScanner > scanner_