laserscanner_lms400.h
Go to the documentation of this file.
1 
18 #ifndef LASERSCANNER_LMS400_H
19 #define LASERSCANNER_LMS400_H
20 
21 #ifndef Q_MOC_RUN
22 #include <sick_lms400.h>
23 #endif
24 #include "abstract_laserscanner.h"
25 
26 
28 {
29  Q_OBJECT
30 public:
31  LaserScanner_LMS400(std::string hostname, int framerate);
32  void run();
33  void stop();
34 
35 signals:
36  void newData(const sensor_msgs::LaserScan::ConstPtr& msg);
37 
38 protected:
39  sensor_msgs::LaserScan::Ptr msg_ptr;
40  asr_sick_lms_400::asr_sick_lms_400 sickLMS400;
41  int framerate;
42  bool active;
43  static constexpr float SCANNER_TARGET_RESOLUTION = 0.2;
44  static constexpr float SCANNER_STARTING_ANGLE = 55;
45  static constexpr float SCANNER_ANGLE_SPREAD = 70;
46 
48  std::string hostname;
49  int Socket;
50  unsigned long LMSError;
52  int MQuality;
53 
54 };
55 
56 
57 #endif // LASERSCANNER_LMS400_H
sensor_msgs::LaserScan::Ptr msg_ptr
LaserScanner_LMS400(std::string hostname, int framerate)
static constexpr float SCANNER_TARGET_RESOLUTION
static constexpr float SCANNER_ANGLE_SPREAD
static constexpr float SCANNER_STARTING_ANGLE
void newData(const sensor_msgs::LaserScan::ConstPtr &msg)
asr_sick_lms_400::asr_sick_lms_400 sickLMS400


asr_mild_calibration_tool
Author(s): Aumann Florian, Heller Florian, Meißner Pascal
autogenerated on Mon Dec 2 2019 03:11:43