Signals | Public Member Functions | Protected Slots | Protected Member Functions | Protected Attributes
rviz::MapDisplay Class Reference

Displays a map along the XY plane. More...

#include <map_display.h>

Inheritance diagram for rviz::MapDisplay:
Inheritance graph
[legend]

List of all members.

Signals

void mapUpdated ()
 Emitted when a new map is received.

Public Member Functions

virtual void fixedFrameChanged ()
 Called by setFixedFrame(). Override to respond to changes to fixed_frame_.
int getHeight ()
float getResolution ()
int getWidth ()
 MapDisplay ()
virtual void onInitialize ()
 Override this function to do subclass-specific initialization.
virtual void reset ()
 Called to tell the display to clear its state.
virtual void setTopic (const QString &topic, const QString &datatype)
 Set the ROS topic to listen to for this display.
virtual ~MapDisplay ()

Protected Slots

void showMap ()
 Show current_map_ in the scene.
void updateAlpha ()
void updateDrawUnder ()
void updatePalette ()
void updateTopic ()

Protected Member Functions

void clear ()
void incomingMap (const nav_msgs::OccupancyGrid::ConstPtr &msg)
 Copy msg into current_map_ and call showMap().
void incomingUpdate (const map_msgs::OccupancyGridUpdate::ConstPtr &update)
 Copy update's data into current_map_ and call showMap().
virtual void onDisable ()
 Derived classes override this to do the actual work of disabling themselves.
virtual void onEnable ()
 Derived classes override this to do the actual work of enabling themselves.
virtual void subscribe ()
void transformMap ()
virtual void unsubscribe ()

Protected Attributes

FloatPropertyalpha_property_
EnumPropertycolor_scheme_property_
std::vector< bool > color_scheme_transparency_
nav_msgs::OccupancyGrid current_map_
Propertydraw_under_property_
std::string frame_
int height_
IntPropertyheight_property_
bool loaded_
Ogre::ManualObject * manual_object_
ros::Subscriber map_sub_
Ogre::MaterialPtr material_
QuaternionPropertyorientation_property_
std::vector< Ogre::TexturePtr > palette_textures_
VectorPropertyposition_property_
float resolution_
FloatPropertyresolution_property_
Ogre::TexturePtr texture_
std::string topic_
RosTopicPropertytopic_property_
ros::Subscriber update_sub_
int width_
IntPropertywidth_property_

Detailed Description

Displays a map along the XY plane.

Definition at line 68 of file map_display.h.


Constructor & Destructor Documentation

Definition at line 62 of file map_display.cpp.

Definition at line 116 of file map_display.cpp.


Member Function Documentation

void rviz::MapDisplay::clear ( ) [protected]

Definition at line 423 of file map_display.cpp.

Called by setFixedFrame(). Override to respond to changes to fixed_frame_.

Reimplemented from rviz::Display.

Definition at line 690 of file map_display.cpp.

int rviz::MapDisplay::getHeight ( ) [inline]

Definition at line 82 of file map_display.h.

float rviz::MapDisplay::getResolution ( ) [inline]

Definition at line 80 of file map_display.h.

int rviz::MapDisplay::getWidth ( ) [inline]

Definition at line 81 of file map_display.h.

void rviz::MapDisplay::incomingMap ( const nav_msgs::OccupancyGrid::ConstPtr &  msg) [protected]

Copy msg into current_map_ and call showMap().

Definition at line 454 of file map_display.cpp.

void rviz::MapDisplay::incomingUpdate ( const map_msgs::OccupancyGridUpdate::ConstPtr &  update) [protected]

Copy update's data into current_map_ and call showMap().

Definition at line 463 of file map_display.cpp.

void rviz::MapDisplay::mapUpdated ( ) [signal]

Emitted when a new map is received.

void rviz::MapDisplay::onDisable ( ) [protected, virtual]

Derived classes override this to do the actual work of disabling themselves.

Reimplemented from rviz::Display.

Definition at line 310 of file map_display.cpp.

void rviz::MapDisplay::onEnable ( ) [protected, virtual]

Derived classes override this to do the actual work of enabling themselves.

Reimplemented from rviz::Display.

Definition at line 305 of file map_display.cpp.

void rviz::MapDisplay::onInitialize ( ) [virtual]

Override this function to do subclass-specific initialization.

This is called after vis_manager_ and scene_manager_ are set, and before load() or setEnabled().

setName() may or may not have been called before this.

Reimplemented from rviz::Display.

Definition at line 227 of file map_display.cpp.

void rviz::MapDisplay::reset ( ) [virtual]

Called to tell the display to clear its state.

Reimplemented from rviz::Display.

Definition at line 695 of file map_display.cpp.

void rviz::MapDisplay::setTopic ( const QString &  topic,
const QString &  datatype 
) [virtual]

Set the ROS topic to listen to for this display.

By default, do nothing. Subclasses should override this method if they subscribe to a single ROS topic.

setTopic() is used by the "New display by topic" window; it is called with a user selected topic and its type.

Parameters:
topicThe published topic to be visualized.
datatypeThe datatype of the topic.

Reimplemented from rviz::Display.

Definition at line 704 of file map_display.cpp.

void rviz::MapDisplay::showMap ( ) [protected, slot]

Show current_map_ in the scene.

Definition at line 492 of file map_display.cpp.

void rviz::MapDisplay::subscribe ( ) [protected, virtual]

Definition at line 316 of file map_display.cpp.

void rviz::MapDisplay::transformMap ( ) [protected]

Definition at line 669 of file map_display.cpp.

void rviz::MapDisplay::unsubscribe ( ) [protected, virtual]

Definition at line 347 of file map_display.cpp.

void rviz::MapDisplay::updateAlpha ( ) [protected, slot]

Definition at line 369 of file map_display.cpp.

void rviz::MapDisplay::updateDrawUnder ( ) [protected, slot]

Definition at line 394 of file map_display.cpp.

void rviz::MapDisplay::updatePalette ( ) [protected, slot]

Definition at line 649 of file map_display.cpp.

void rviz::MapDisplay::updateTopic ( ) [protected, slot]

Definition at line 416 of file map_display.cpp.


Member Data Documentation

Definition at line 139 of file map_display.h.

Definition at line 141 of file map_display.h.

std::vector<bool> rviz::MapDisplay::color_scheme_transparency_ [protected]

Definition at line 119 of file map_display.h.

nav_msgs::OccupancyGrid rviz::MapDisplay::current_map_ [protected]

Definition at line 128 of file map_display.h.

Definition at line 140 of file map_display.h.

std::string rviz::MapDisplay::frame_ [protected]

Definition at line 127 of file map_display.h.

int rviz::MapDisplay::height_ [protected]

Definition at line 126 of file map_display.h.

Definition at line 136 of file map_display.h.

bool rviz::MapDisplay::loaded_ [protected]

Definition at line 121 of file map_display.h.

Ogre::ManualObject* rviz::MapDisplay::manual_object_ [protected]

Definition at line 116 of file map_display.h.

Definition at line 130 of file map_display.h.

Ogre::MaterialPtr rviz::MapDisplay::material_ [protected]

Definition at line 120 of file map_display.h.

Definition at line 138 of file map_display.h.

std::vector<Ogre::TexturePtr> rviz::MapDisplay::palette_textures_ [protected]

Definition at line 118 of file map_display.h.

Definition at line 137 of file map_display.h.

float rviz::MapDisplay::resolution_ [protected]

Definition at line 124 of file map_display.h.

Definition at line 134 of file map_display.h.

Ogre::TexturePtr rviz::MapDisplay::texture_ [protected]

Definition at line 117 of file map_display.h.

std::string rviz::MapDisplay::topic_ [protected]

Definition at line 123 of file map_display.h.

Definition at line 133 of file map_display.h.

Definition at line 131 of file map_display.h.

int rviz::MapDisplay::width_ [protected]

Definition at line 125 of file map_display.h.

Definition at line 135 of file map_display.h.


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


rviz
Author(s): Dave Hershberger, David Gossow, Josh Faust
autogenerated on Thu Aug 27 2015 15:02:29