#include <DrawLineHandler.h>

Public Member Functions | |
| DrawLineHandler () | |
| bool | endOfSimulation () |
| unsigned int | getObjectType () const |
| void | handleSimulation () |
| void | synchronize () |
| ~DrawLineHandler () | |
Static Public Attributes | |
| static const unsigned int | DRAWING_DATA_DIFFUSE = DrawLineHandler::DRAWING_DATA_WIDTH + 1 |
| Custom data used to specify line diffuse color component. | |
| static const unsigned int | DRAWING_DATA_EMISSION = DrawLineHandler::DRAWING_DATA_SPECULAR + 1 |
| Custom data used to specify line emissive color component. | |
| static const unsigned int | DRAWING_DATA_MAIN = boost::hash<std::string>()("DrawLineHandler") |
| Main custom data. Also used to specify drawing frequency. | |
| static const unsigned int | DRAWING_DATA_MARKERS = DrawLineHandler::DRAWING_DATA_EMISSION + 1 |
| Custom data used to specify if markers should be drawn. Not implemented yet. | |
| static const unsigned int | DRAWING_DATA_MARKERS_DIFFUSE = DrawLineHandler::DRAWING_DATA_MARKERS + 1 |
| Custom data used to specify markers diffuse color component. Not implemented yet. | |
| static const unsigned int | DRAWING_DATA_MARKERS_EMISSION = DrawLineHandler::DRAWING_DATA_MARKERS_SPECULAR + 1 |
| Custom data used to specify markers emissive color component. Not implemented yet. | |
| static const unsigned int | DRAWING_DATA_MARKERS_SPECULAR = DrawLineHandler::DRAWING_DATA_MARKERS_DIFFUSE + 1 |
| Custom data used to specify markers specular color component. Not implemented yet. | |
| static const unsigned int | DRAWING_DATA_SPECULAR = DrawLineHandler::DRAWING_DATA_DIFFUSE + 1 |
| Custom data used to specify line specular color component. | |
| static const unsigned int | DRAWING_DATA_WIDTH = DrawLineHandler::DRAWING_DATA_MAIN + 1 |
| Custom data used to specify line width. | |
Protected Member Functions | |
| void | _initialize () |
| void | lineCallback (geometry_msgs::PolygonStampedConstPtr msg) |
| void | registerCustomVariables () const |
Protected Attributes | |
| simFloat | _diffuse [3] |
| Line diffuse color. | |
| simInt | _drawingObject |
| simFloat | _emission [3] |
| Line emission color. | |
| simFloat | _frequency |
| simFloat | _lastTime |
| geometry_msgs::PolygonStampedConstPtr | _line |
| simFloat | _specular [3] |
| Line specular color. | |
| ros::Subscriber | _sub |
| simInt | _width |
| Line width. | |
Definition at line 8 of file DrawLineHandler.h.
Definition at line 26 of file DrawLineHandler.cpp.
Definition at line 41 of file DrawLineHandler.cpp.
| void DrawLineHandler::_initialize | ( | ) | [protected, virtual] |
Implements GenericObjectHandler.
Definition at line 113 of file DrawLineHandler.cpp.
| bool DrawLineHandler::endOfSimulation | ( | ) | [virtual] |
Reimplemented from GenericObjectHandler.
Definition at line 71 of file DrawLineHandler.cpp.
| unsigned int DrawLineHandler::getObjectType | ( | ) | const [virtual] |
Implements GenericObjectHandler.
Definition at line 44 of file DrawLineHandler.cpp.
| void DrawLineHandler::handleSimulation | ( | ) | [virtual] |
Implements GenericObjectHandler.
Definition at line 79 of file DrawLineHandler.cpp.
| void DrawLineHandler::lineCallback | ( | geometry_msgs::PolygonStampedConstPtr | msg | ) | [protected] |
Callback for velocity commands.
Definition at line 188 of file DrawLineHandler.cpp.
| void DrawLineHandler::registerCustomVariables | ( | ) | const [protected] |
Register custom lua variables for use in Lua scripts
Definition at line 192 of file DrawLineHandler.cpp.
| void DrawLineHandler::synchronize | ( | ) | [virtual] |
Reimplemented from GenericObjectHandler.
Definition at line 48 of file DrawLineHandler.cpp.
simFloat DrawLineHandler::_diffuse[3] [protected] |
Line diffuse color.
Definition at line 88 of file DrawLineHandler.h.
simInt DrawLineHandler::_drawingObject [protected] |
Drawing object handle
Definition at line 84 of file DrawLineHandler.h.
simFloat DrawLineHandler::_emission[3] [protected] |
Line emission color.
Definition at line 90 of file DrawLineHandler.h.
simFloat DrawLineHandler::_frequency [protected] |
Drawing frequency
Definition at line 79 of file DrawLineHandler.h.
simFloat DrawLineHandler::_lastTime [protected] |
Simulation time of the last drawing.
Definition at line 74 of file DrawLineHandler.h.
geometry_msgs::PolygonStampedConstPtr DrawLineHandler::_line [protected] |
Last received message.
Definition at line 64 of file DrawLineHandler.h.
simFloat DrawLineHandler::_specular[3] [protected] |
Line specular color.
Definition at line 89 of file DrawLineHandler.h.
ros::Subscriber DrawLineHandler::_sub [protected] |
Subscriber for receiving line points.
Definition at line 59 of file DrawLineHandler.h.
simInt DrawLineHandler::_width [protected] |
Line width.
Definition at line 87 of file DrawLineHandler.h.
const unsigned int DrawLineHandler::DRAWING_DATA_DIFFUSE = DrawLineHandler::DRAWING_DATA_WIDTH + 1 [static] |
Custom data used to specify line diffuse color component.
Definition at line 36 of file DrawLineHandler.h.
const unsigned int DrawLineHandler::DRAWING_DATA_EMISSION = DrawLineHandler::DRAWING_DATA_SPECULAR + 1 [static] |
Custom data used to specify line emissive color component.
Definition at line 38 of file DrawLineHandler.h.
const unsigned int DrawLineHandler::DRAWING_DATA_MAIN = boost::hash<std::string>()("DrawLineHandler") [static] |
Main custom data. Also used to specify drawing frequency.
Definition at line 34 of file DrawLineHandler.h.
const unsigned int DrawLineHandler::DRAWING_DATA_MARKERS = DrawLineHandler::DRAWING_DATA_EMISSION + 1 [static] |
Custom data used to specify if markers should be drawn. Not implemented yet.
Definition at line 39 of file DrawLineHandler.h.
const unsigned int DrawLineHandler::DRAWING_DATA_MARKERS_DIFFUSE = DrawLineHandler::DRAWING_DATA_MARKERS + 1 [static] |
Custom data used to specify markers diffuse color component. Not implemented yet.
Definition at line 40 of file DrawLineHandler.h.
const unsigned int DrawLineHandler::DRAWING_DATA_MARKERS_EMISSION = DrawLineHandler::DRAWING_DATA_MARKERS_SPECULAR + 1 [static] |
Custom data used to specify markers emissive color component. Not implemented yet.
Definition at line 42 of file DrawLineHandler.h.
const unsigned int DrawLineHandler::DRAWING_DATA_MARKERS_SPECULAR = DrawLineHandler::DRAWING_DATA_MARKERS_DIFFUSE + 1 [static] |
Custom data used to specify markers specular color component. Not implemented yet.
Definition at line 41 of file DrawLineHandler.h.
const unsigned int DrawLineHandler::DRAWING_DATA_SPECULAR = DrawLineHandler::DRAWING_DATA_DIFFUSE + 1 [static] |
Custom data used to specify line specular color component.
Definition at line 37 of file DrawLineHandler.h.
const unsigned int DrawLineHandler::DRAWING_DATA_WIDTH = DrawLineHandler::DRAWING_DATA_MAIN + 1 [static] |
Custom data used to specify line width.
Definition at line 35 of file DrawLineHandler.h.