22 #ifndef STDR_GUI_LASER_CONTAINER 23 #define STDR_GUI_LASER_CONTAINER 26 #include "stdr_msgs/LaserSensorMsg.h" 27 #include "sensor_msgs/LaserScan.h" 53 stdr_msgs::LaserSensorMsg
msg_;
73 CGuiLaser(stdr_msgs::LaserSensorMsg msg,std::string baseTopic);
86 void callback(
const sensor_msgs::LaserScan& msg);
float getMaxRange(void)
Returns the max range of the specific laser sensor.
char getVisualizationStatus(void)
Returns the visibility status of the specific laser sensor.
void setVisualizationStatus(char vs)
Sets the visibility status of the specific laser sensor.
CGuiLaser(stdr_msgs::LaserSensorMsg msg, std::string baseTopic)
Default contructor.
~CGuiLaser(void)
Default destructor.
ros::Subscriber subscriber_
The ros laser scan msg.
char visualization_status_
sensor_msgs::LaserScan scan_
Visualization status of the specific laser.
void callback(const sensor_msgs::LaserScan &msg)
Callback for the ros laser message.
void visualizerPaint(QImage *m, float ocgd, float maxRange)
Paints the laser scan in it's own visualizer.
std::string topic_
The ROS tf frame.
stdr_msgs::LaserSensorMsg msg_
Subscriber for the ros laser msg.
void toggleVisualizationStatus(void)
Toggles the visibility status of the specific laser sensor.
The main namespace for STDR GUI.
void paint(QImage *m, float ocgd, tf::TransformListener *listener)
Paints the laser scan in the map image.
std::string getFrameId(void)
Returns the frame id of the specific laser sensor.
bool lock_
< Used to avoid drawing when a new laser message arives
Implements the functionalities for a laser sensor.
std::string tf_frame_
A laser sensor message : Depscription of a laser sensor.