Public Member Functions | Private Attributes | List of all members
mitre_fast_layered_map::StaticMap Class Reference

#include <static_map.hpp>

Public Member Functions

void gridMapCb (const grid_map_msgs::GridMap &)
 
int init ()
 
void mapMarkerCb (const visualization_msgs::Marker &)
 
int once ()
 
int publishMap ()
 
 StaticMap ()
 
 StaticMap (ros::NodeHandle *, StaticMapConfiguration)
 
void staticMapCb (const nav_msgs::OccupancyGrid &)
 
 ~StaticMap ()
 

Private Attributes

StaticMapConfiguration config_
 
grid_map::GridMap gridMap_
 
ros::Publisher gridMapPub_
 
ros::Subscriber gridMapSub_
 
bool initialized_ {false}
 
ros::Subscriber markerSub_
 
ros::NodeHandle nh_
 
ros::Publisher occGridPub_
 
bool recStaticMap_ {false}
 
ros::Subscriber staticMapSub_
 
tf2_ros::Buffer tfBuffer_
 Holds transformations from tf tree. More...
 
tf2_ros::TransformListener tfListener_
 Used in tfBuffer_. More...
 

Detailed Description

Definition at line 44 of file static_map.hpp.

Constructor & Destructor Documentation

mitre_fast_layered_map::StaticMap::StaticMap ( )

Definition at line 6 of file static_map.cpp.

mitre_fast_layered_map::StaticMap::StaticMap ( ros::NodeHandle _nh,
StaticMapConfiguration  _config 
)

Definition at line 9 of file static_map.cpp.

mitre_fast_layered_map::StaticMap::~StaticMap ( )

Definition at line 16 of file static_map.cpp.

Member Function Documentation

void mitre_fast_layered_map::StaticMap::gridMapCb ( const grid_map_msgs::GridMap &  _inMap)

Definition at line 118 of file static_map.cpp.

int mitre_fast_layered_map::StaticMap::init ( )

Definition at line 18 of file static_map.cpp.

void mitre_fast_layered_map::StaticMap::mapMarkerCb ( const visualization_msgs::Marker &  _marker)

Definition at line 89 of file static_map.cpp.

int mitre_fast_layered_map::StaticMap::once ( )

Definition at line 45 of file static_map.cpp.

int mitre_fast_layered_map::StaticMap::publishMap ( )

Definition at line 180 of file static_map.cpp.

void mitre_fast_layered_map::StaticMap::staticMapCb ( const nav_msgs::OccupancyGrid &  _occGrid)

Definition at line 62 of file static_map.cpp.

Member Data Documentation

StaticMapConfiguration mitre_fast_layered_map::StaticMap::config_
private

Definition at line 80 of file static_map.hpp.

grid_map::GridMap mitre_fast_layered_map::StaticMap::gridMap_
private

Definition at line 78 of file static_map.hpp.

ros::Publisher mitre_fast_layered_map::StaticMap::gridMapPub_
private

Definition at line 69 of file static_map.hpp.

ros::Subscriber mitre_fast_layered_map::StaticMap::gridMapSub_
private

Definition at line 67 of file static_map.hpp.

bool mitre_fast_layered_map::StaticMap::initialized_ {false}
private

Definition at line 76 of file static_map.hpp.

ros::Subscriber mitre_fast_layered_map::StaticMap::markerSub_
private

Definition at line 66 of file static_map.hpp.

ros::NodeHandle mitre_fast_layered_map::StaticMap::nh_
private

Definition at line 64 of file static_map.hpp.

ros::Publisher mitre_fast_layered_map::StaticMap::occGridPub_
private

Definition at line 68 of file static_map.hpp.

bool mitre_fast_layered_map::StaticMap::recStaticMap_ {false}
private

Definition at line 77 of file static_map.hpp.

ros::Subscriber mitre_fast_layered_map::StaticMap::staticMapSub_
private

Definition at line 65 of file static_map.hpp.

tf2_ros::Buffer mitre_fast_layered_map::StaticMap::tfBuffer_
private

Holds transformations from tf tree.

Definition at line 72 of file static_map.hpp.

tf2_ros::TransformListener mitre_fast_layered_map::StaticMap::tfListener_
private

Used in tfBuffer_.

Definition at line 73 of file static_map.hpp.


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


mitre_fast_layered_map
Author(s):
autogenerated on Thu Mar 11 2021 03:06:49