Public Member Functions | Protected Member Functions | Protected Attributes
nav_grid_pub_sub::ScaleGridPublisher< NumericType > Class Template Reference

An interface for publishing NavGridOfDoubles/OccupancyGrid msgs and their updates periodically. More...

#include <nav_grid_publisher.h>

Inheritance diagram for nav_grid_pub_sub::ScaleGridPublisher< NumericType >:
Inheritance graph
[legend]

List of all members.

Public Member Functions

void setIgnoreValue (NumericType ignore_value)

Protected Member Functions

nav_msgs::OccupancyGrid toOccupancyGrid (const ros::Time &timestamp) override
map_msgs::OccupancyGridUpdate toOccupancyGridUpdate (const nav_core2::UIntBounds &bounds, const ros::Time &timestamp) override

Protected Attributes

NumericType max_val_
NumericType min_val_

Detailed Description

template<typename NumericType>
class nav_grid_pub_sub::ScaleGridPublisher< NumericType >

An interface for publishing NavGridOfDoubles/OccupancyGrid msgs and their updates periodically.

Definition at line 364 of file nav_grid_publisher.h.


Member Function Documentation

template<typename NumericType >
void nav_grid_pub_sub::ScaleGridPublisher< NumericType >::setIgnoreValue ( NumericType  ignore_value) [inline]

Definition at line 371 of file nav_grid_publisher.h.

template<typename NumericType >
nav_msgs::OccupancyGrid nav_grid_pub_sub::ScaleGridPublisher< NumericType >::toOccupancyGrid ( const ros::Time timestamp) [inline, override, protected, virtual]
template<typename NumericType >
map_msgs::OccupancyGridUpdate nav_grid_pub_sub::ScaleGridPublisher< NumericType >::toOccupancyGridUpdate ( const nav_core2::UIntBounds bounds,
const ros::Time timestamp 
) [inline, override, protected, virtual]

Member Data Documentation

template<typename NumericType >
NumericType nav_grid_pub_sub::ScaleGridPublisher< NumericType >::max_val_ [protected]

Definition at line 386 of file nav_grid_publisher.h.

template<typename NumericType >
NumericType nav_grid_pub_sub::ScaleGridPublisher< NumericType >::min_val_ [protected]

Definition at line 386 of file nav_grid_publisher.h.


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


nav_grid_pub_sub
Author(s):
autogenerated on Wed Jun 26 2019 20:09:52