Public Member Functions | Private Member Functions | Private Attributes
rve_common_transformers::Map Class Reference

#include <map.h>

Inheritance diagram for rve_common_transformers::Map:
Inheritance graph
[legend]

List of all members.

Public Member Functions

 Map ()
 ~Map ()

Private Member Functions

void makeBlock (int i, int j)
void makeMesh (sensor_msgs::ImagePtr &image)
virtual void onInit ()
void onPropertyChanged (const rve_properties::PropertyNodePtr &node, const std::string &, rve_properties::PropertyChangeType type)
virtual void onUpdate ()
void receiveOccupancyGrid (const nav_msgs::OccupancyGridConstPtr &msg)

Private Attributes

std::string frame_
nav_msgs::OccupancyGridConstPtr map_
double map_height_meters_
int map_height_pixels_
sensor_msgs::ImagePtr map_image_
ros::Subscriber map_sub_
rve_render_client::TexturePtr map_texture_
double map_width_meters_
int map_width_pixels_
rve_render_client::MeshInstancePtr mesh_instance_
rve_msgs::Quaternion orientation_
rve_msgs::Vector3 position_
double resolution_

Detailed Description

Definition at line 44 of file map.h.


Constructor & Destructor Documentation

Definition at line 52 of file map.cpp.

Definition at line 56 of file map.cpp.


Member Function Documentation

void rve_common_transformers::Map::makeBlock ( int  i,
int  j 
) [private]
void rve_common_transformers::Map::makeMesh ( sensor_msgs::ImagePtr &  image) [private]

Definition at line 69 of file map.cpp.

void rve_common_transformers::Map::onInit ( ) [private, virtual]

Implements rve_transformer::Transformer.

Definition at line 61 of file map.cpp.

void rve_common_transformers::Map::onPropertyChanged ( const rve_properties::PropertyNodePtr node,
const std::string &  path,
rve_properties::PropertyChangeType  type 
) [private]

Definition at line 237 of file map.cpp.

void rve_common_transformers::Map::onUpdate ( ) [private, virtual]

Implements rve_transformer::Transformer.

Definition at line 212 of file map.cpp.

void rve_common_transformers::Map::receiveOccupancyGrid ( const nav_msgs::OccupancyGridConstPtr &  msg) [private]

Definition at line 133 of file map.cpp.


Member Data Documentation

std::string rve_common_transformers::Map::frame_ [private]

Definition at line 72 of file map.h.

nav_msgs::OccupancyGridConstPtr rve_common_transformers::Map::map_ [private]

Definition at line 64 of file map.h.

Definition at line 70 of file map.h.

Definition at line 68 of file map.h.

sensor_msgs::ImagePtr rve_common_transformers::Map::map_image_ [private]

Definition at line 61 of file map.h.

Definition at line 62 of file map.h.

Definition at line 59 of file map.h.

Definition at line 69 of file map.h.

Definition at line 67 of file map.h.

Definition at line 60 of file map.h.

Definition at line 66 of file map.h.

Definition at line 65 of file map.h.

Definition at line 71 of file map.h.


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


rve_common_transformers
Author(s): Josh Faust
autogenerated on Wed Dec 11 2013 14:31:58