22 #ifndef STDR_LASER_VISUALIZATION 23 #define STDR_LASER_VISUALIZATION 26 #include "ui_laserVisualization.h" 40 public Ui_laserVisualization
56 stdr_msgs::LaserSensorMsg
msg_;
92 void setLaser(stdr_msgs::LaserSensorMsg msg);
112 void callback(
const sensor_msgs::LaserScan& msg);
float resolution_
The latest laser scan.
sensor_msgs::LaserScan scan_
Subscriber for getting the laser scans.
stdr_msgs::LaserSensorMsg msg_
The image to draw into.
void destruct(void)
Destroys the visualizer.
ros::Subscriber subscriber_
Description of the laser sensor.
bool active_
< True if the visualizer is active
CLaserVisualisation(QString name, float resolution)
Default contructor.
void setLaser(stdr_msgs::LaserSensorMsg msg)
Sets the laser description message.
void paint(void)
Paints the visualizer.
Implements the functionalities of the laser visualization widget. Inherits form QWidget and Ui_laserV...
QImage internal_image_
A void image.
The main namespace for STDR GUI.
void closeEvent(QCloseEvent *event)
Called when the close event is triggered.
QImage void_image_
The laser frame id.
bool getActive(void)
Returns true if the visualizer is active.
~CLaserVisualisation(void)
Default destructor.
void callback(const sensor_msgs::LaserScan &msg)
Called when new laser data are available.