22 #ifndef STDR_ROBOT_VISUALIZATION 23 #define STDR_ROBOT_VISUALIZATION 26 #include "ui_robotVisualization.h" 40 public Ui_robotVisualization
bool getActive(void)
Returns true if the visualizer is active.
Implements the functionalities of the robot visualization widget. Inherits form QWidget and Ui_robotV...
QImage internal_image_
A void image.
void setCurrentSpeed(std::vector< float > msg)
Sets the robot's current speed.
int getInternalImageSize(void)
Returns the internal image size.
void setCurrentPose(geometry_msgs::Pose2D pose)
Sets the robot's current pose.
void closeEvent(QCloseEvent *event)
Called when the close event is triggered.
QImage void_image_
The robot frame id.
float resolution_
The image to draw into.
void setImage(QImage img)
Sets the image to be shown.
CRobotVisualisation(QString name, float resolution)
Default contructor.
bool active_
< True if the visualizer is active
The main namespace for STDR GUI.
void destruct(void)
Destroys the visualizer.
~CRobotVisualisation(void)
Default destructor.