Public Member Functions | Private Attributes
stdr_gui::CRobotVisualisation Class Reference

Implements the functionalities of the robot visualization widget. Inherits form QWidget and Ui_robotVisualization (auto created from ui file) More...

#include <stdr_robot_visualization.h>

List of all members.

Public Member Functions

void closeEvent (QCloseEvent *event)
 Called when the close event is triggered.
 CRobotVisualisation (QString name, float resolution)
 Default contructor.
void destruct (void)
 Destroys the visualizer.
bool getActive (void)
 Returns true if the visualizer is active.
int getInternalImageSize (void)
 Returns the internal image size.
void setCurrentPose (geometry_msgs::Pose2D pose)
 Sets the robot's current pose.
void setCurrentSpeed (std::vector< float > msg)
 Sets the robot's current speed.
void setImage (QImage img)
 Sets the image to be shown.
 ~CRobotVisualisation (void)
 Default destructor.

Private Attributes

bool active_
 < True if the visualizer is active
QImage internal_image_
 A void image.
QString name_
float resolution_
 The image to draw into.
QImage void_image_
 The robot frame id.

Detailed Description

Implements the functionalities of the robot visualization widget. Inherits form QWidget and Ui_robotVisualization (auto created from ui file)

Definition at line 38 of file stdr_robot_visualization.h.


Constructor & Destructor Documentation

stdr_gui::CRobotVisualisation::CRobotVisualisation ( QString  name,
float  resolution 
)

Default contructor.

Parameters:
name[QString] Robot frame id
resolution[float] Map resolution
Returns:
void

Definition at line 32 of file stdr_robot_visualization.cpp.

Default destructor.

Returns:
void

Definition at line 52 of file stdr_robot_visualization.cpp.


Member Function Documentation

void stdr_gui::CRobotVisualisation::closeEvent ( QCloseEvent *  event)

Called when the close event is triggered.

Parameters:
event[QCloseEvent*] The close event
Returns:
void

Definition at line 75 of file stdr_robot_visualization.cpp.

Destroys the visualizer.

Returns:
void

Definition at line 61 of file stdr_robot_visualization.cpp.

Returns true if the visualizer is active.

Returns:
bool

Definition at line 85 of file stdr_robot_visualization.cpp.

Returns the internal image size.

Returns:
int : Width of the internal image
void stdr_gui::CRobotVisualisation::setCurrentPose ( geometry_msgs::Pose2D  pose)

Sets the robot's current pose.

Parameters:
pose[geometry_msgs::Pose2D] the robot pose
Returns:
void

Definition at line 107 of file stdr_robot_visualization.cpp.

void stdr_gui::CRobotVisualisation::setCurrentSpeed ( std::vector< float >  msg)

Sets the robot's current speed.

Parameters:
msg[std::vector<float>] the robot speeds
Returns:
void
Parameters:
msg[std::pair<float,float>] the robot speeds
Returns:
void

Definition at line 122 of file stdr_robot_visualization.cpp.

Sets the image to be shown.

Parameters:
img[QImage] The drawn image
Returns:
void

Definition at line 95 of file stdr_robot_visualization.cpp.


Member Data Documentation

< True if the visualizer is active

The map resolution

Definition at line 46 of file stdr_robot_visualization.h.

A void image.

Definition at line 50 of file stdr_robot_visualization.h.

Definition at line 53 of file stdr_robot_visualization.h.

The image to draw into.

Definition at line 48 of file stdr_robot_visualization.h.

The robot frame id.

Definition at line 52 of file stdr_robot_visualization.h.


The documentation for this class was generated from the following files:


stdr_gui
Author(s): Manos Tsardoulias
autogenerated on Tue Feb 7 2017 03:46:43