Public Member Functions | Protected Attributes
global_planner_tests::EasyCostmap Class Reference

An instantiation of the Costmap class that simply populates the grid from an image. More...

#include <easy_costmap.h>

Inheritance diagram for global_planner_tests::EasyCostmap:
Inheritance graph
[legend]

List of all members.

Public Member Functions

 EasyCostmap (const std::string &filename, const double resolution=0.1, const bool origin_at_center=false)
 Constructor, loads directly from an image filename.
 EasyCostmap ()
 Empty constructor. You need to call loadMapFromFile afterward.
void loadMapFromFile (const std::string &filename, const double resolution=0.1, const bool origin_at_center=false)
void reset () override

Protected Attributes

nav_msgs::OccupancyGrid original_grid_

Detailed Description

An instantiation of the Costmap class that simply populates the grid from an image.

Definition at line 48 of file easy_costmap.h.


Constructor & Destructor Documentation

global_planner_tests::EasyCostmap::EasyCostmap ( const std::string &  filename,
const double  resolution = 0.1,
const bool  origin_at_center = false 
) [explicit]

Constructor, loads directly from an image filename.

Parameters:
filenameThe filename for the image to load
resolutionRather than loading from a yaml file, you can specify the resolution here
origin_at_centerIf true, will put the origin of the map at the center, rather than the bottom left

Definition at line 45 of file easy_costmap.cpp.

Empty constructor. You need to call loadMapFromFile afterward.

Definition at line 62 of file easy_costmap.h.


Member Function Documentation

void global_planner_tests::EasyCostmap::loadMapFromFile ( const std::string &  filename,
const double  resolution = 0.1,
const bool  origin_at_center = false 
)

Definition at line 50 of file easy_costmap.cpp.

Reimplemented from nav_core2::BasicCostmap.

Definition at line 66 of file easy_costmap.cpp.


Member Data Documentation

nav_msgs::OccupancyGrid global_planner_tests::EasyCostmap::original_grid_ [protected]

Definition at line 71 of file easy_costmap.h.


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


global_planner_tests
Author(s):
autogenerated on Wed Jun 26 2019 20:09:34