Public Member Functions | Protected Member Functions | Protected Attributes | List of all members
hector_geotiff::GeotiffWriter Class Reference

#include <geotiff_writer.h>

Inheritance diagram for hector_geotiff::GeotiffWriter:
Inheritance graph
[legend]

Public Member Functions

void drawBackgroundCheckerboard ()
 
void drawCoords ()
 
void drawMap (const nav_msgs::OccupancyGrid &map, bool draw_explored_space_grid=true)
 
void drawObjectOfInterest (const Eigen::Vector2f &coords, const std::string &txt, const Color &color, const Shape &shape)
 
virtual void drawPath (const Eigen::Vector3f &start, const std::vector< Eigen::Vector2f > &points)
 
void drawPath (const Eigen::Vector3f &start, const std::vector< Eigen::Vector2f > &points, int color_r, int color_g, int color_b)
 
 GeotiffWriter (bool useCheckerboardCacheIn=false)
 
std::string getBasePathAndFileName () const
 
void setMapFileName (const std::string &mapFileName)
 
void setMapFilePath (const std::string &mapFilePath)
 
void setupImageSize ()
 
bool setupTransforms (const nav_msgs::OccupancyGrid &map)
 
void setUseUtcTimeSuffix (bool useSuffix)
 
void writeGeotiffImage ()
 
virtual ~GeotiffWriter ()
 

Protected Member Functions

void drawArrow (QPainter &painter)
 
void drawCoordSystem (QPainter &painter)
 
void drawCross (QPainter &painter, const Eigen::Vector2f &coords)
 
void transformPainterToImgCoords (QPainter &painter)
 

Protected Attributes

QApplication * app
 
nav_msgs::MapMetaData cached_map_meta_data_
 
QImage checkerboard_cache
 
int fake_argc_
 
char ** fake_argv_
 
Eigen::Vector2i geoTiffSizePixels
 
QImage image
 
Eigen::Vector2f leftTopMarginMeters
 
QFont map_draw_font_
 
std::string map_file_name_
 
std::string map_file_path_
 
HectorMapTools::CoordinateTransformer< float > map_geo_transformer_
 
Eigen::Vector2f mapEndInGeotiff
 
Eigen::Vector2f mapOrigInGeotiff
 
Eigen::Vector2i maxCoordsMap
 
Eigen::Vector2i minCoordsMap
 
Eigen::Vector2f origin
 
float pixelsPerGeoTiffMeter
 
float pixelsPerMapMeter
 
float resolution
 
int resolutionFactor
 
float resolutionFactorf
 
Eigen::Vector2f rightBottomMarginMeters
 
Eigen::Vector2i rightBottomMarginPixels
 
Eigen::Vector2f rightBottomMarginPixelsf
 
Eigen::Vector2i sizeMap
 
Eigen::Vector2f sizeMapf
 
Eigen::Vector2f totalMeters
 
bool use_utc_time_suffix_
 
bool useCheckerboardCache
 
HectorMapTools::CoordinateTransformer< float > world_geo_transformer_
 
HectorMapTools::CoordinateTransformer< float > world_map_transformer_
 

Detailed Description

Definition at line 50 of file geotiff_writer.h.

Constructor & Destructor Documentation

◆ GeotiffWriter()

hector_geotiff::GeotiffWriter::GeotiffWriter ( bool  useCheckerboardCacheIn = false)

Definition at line 43 of file geotiff_writer.cpp.

◆ ~GeotiffWriter()

hector_geotiff::GeotiffWriter::~GeotiffWriter ( )
virtual

Definition at line 60 of file geotiff_writer.cpp.

Member Function Documentation

◆ drawArrow()

void hector_geotiff::GeotiffWriter::drawArrow ( QPainter &  painter)
protected

Definition at line 560 of file geotiff_writer.cpp.

◆ drawBackgroundCheckerboard()

void hector_geotiff::GeotiffWriter::drawBackgroundCheckerboard ( )

Definition at line 230 of file geotiff_writer.cpp.

◆ drawCoords()

void hector_geotiff::GeotiffWriter::drawCoords ( )

Definition at line 523 of file geotiff_writer.cpp.

◆ drawCoordSystem()

void hector_geotiff::GeotiffWriter::drawCoordSystem ( QPainter &  painter)
protected

Definition at line 580 of file geotiff_writer.cpp.

◆ drawCross()

void hector_geotiff::GeotiffWriter::drawCross ( QPainter &  painter,
const Eigen::Vector2f &  coords 
)
protected

Definition at line 554 of file geotiff_writer.cpp.

◆ drawMap()

void hector_geotiff::GeotiffWriter::drawMap ( const nav_msgs::OccupancyGrid &  map,
bool  draw_explored_space_grid = true 
)

Definition at line 272 of file geotiff_writer.cpp.

◆ drawObjectOfInterest()

void hector_geotiff::GeotiffWriter::drawObjectOfInterest ( const Eigen::Vector2f &  coords,
const std::string &  txt,
const Color color,
const Shape shape 
)
virtual

Implements hector_geotiff::MapWriterInterface.

Definition at line 353 of file geotiff_writer.cpp.

◆ drawPath() [1/2]

virtual void hector_geotiff::GeotiffWriter::drawPath ( const Eigen::Vector3f &  start,
const std::vector< Eigen::Vector2f > &  points 
)
inlinevirtual

Reimplemented from hector_geotiff::MapWriterInterface.

Definition at line 67 of file geotiff_writer.h.

◆ drawPath() [2/2]

void hector_geotiff::GeotiffWriter::drawPath ( const Eigen::Vector3f &  start,
const std::vector< Eigen::Vector2f > &  points,
int  color_r,
int  color_g,
int  color_b 
)
virtual

Implements hector_geotiff::MapWriterInterface.

Definition at line 411 of file geotiff_writer.cpp.

◆ getBasePathAndFileName()

std::string hector_geotiff::GeotiffWriter::getBasePathAndFileName ( ) const
virtual

Implements hector_geotiff::MapWriterInterface.

Definition at line 453 of file geotiff_writer.cpp.

◆ setMapFileName()

void hector_geotiff::GeotiffWriter::setMapFileName ( const std::string &  mapFileName)

Definition at line 65 of file geotiff_writer.cpp.

◆ setMapFilePath()

void hector_geotiff::GeotiffWriter::setMapFilePath ( const std::string &  mapFilePath)

Definition at line 79 of file geotiff_writer.cpp.

◆ setupImageSize()

void hector_geotiff::GeotiffWriter::setupImageSize ( )

Definition at line 207 of file geotiff_writer.cpp.

◆ setupTransforms()

bool hector_geotiff::GeotiffWriter::setupTransforms ( const nav_msgs::OccupancyGrid &  map)

Definition at line 90 of file geotiff_writer.cpp.

◆ setUseUtcTimeSuffix()

void hector_geotiff::GeotiffWriter::setUseUtcTimeSuffix ( bool  useSuffix)

Definition at line 84 of file geotiff_writer.cpp.

◆ transformPainterToImgCoords()

void hector_geotiff::GeotiffWriter::transformPainterToImgCoords ( QPainter &  painter)
protected

Definition at line 516 of file geotiff_writer.cpp.

◆ writeGeotiffImage()

void hector_geotiff::GeotiffWriter::writeGeotiffImage ( )

Definition at line 458 of file geotiff_writer.cpp.

Member Data Documentation

◆ app

QApplication* hector_geotiff::GeotiffWriter::app
protected

Definition at line 119 of file geotiff_writer.h.

◆ cached_map_meta_data_

nav_msgs::MapMetaData hector_geotiff::GeotiffWriter::cached_map_meta_data_
protected

Definition at line 126 of file geotiff_writer.h.

◆ checkerboard_cache

QImage hector_geotiff::GeotiffWriter::checkerboard_cache
protected

Definition at line 118 of file geotiff_writer.h.

◆ fake_argc_

int hector_geotiff::GeotiffWriter::fake_argc_
protected

Definition at line 128 of file geotiff_writer.h.

◆ fake_argv_

char** hector_geotiff::GeotiffWriter::fake_argv_
protected

Definition at line 129 of file geotiff_writer.h.

◆ geoTiffSizePixels

Eigen::Vector2i hector_geotiff::GeotiffWriter::geoTiffSizePixels
protected

Definition at line 109 of file geotiff_writer.h.

◆ image

QImage hector_geotiff::GeotiffWriter::image
protected

Definition at line 117 of file geotiff_writer.h.

◆ leftTopMarginMeters

Eigen::Vector2f hector_geotiff::GeotiffWriter::leftTopMarginMeters
protected

Definition at line 105 of file geotiff_writer.h.

◆ map_draw_font_

QFont hector_geotiff::GeotiffWriter::map_draw_font_
protected

Definition at line 120 of file geotiff_writer.h.

◆ map_file_name_

std::string hector_geotiff::GeotiffWriter::map_file_name_
protected

Definition at line 114 of file geotiff_writer.h.

◆ map_file_path_

std::string hector_geotiff::GeotiffWriter::map_file_path_
protected

Definition at line 115 of file geotiff_writer.h.

◆ map_geo_transformer_

HectorMapTools::CoordinateTransformer<float> hector_geotiff::GeotiffWriter::map_geo_transformer_
protected

Definition at line 123 of file geotiff_writer.h.

◆ mapEndInGeotiff

Eigen::Vector2f hector_geotiff::GeotiffWriter::mapEndInGeotiff
protected

Definition at line 112 of file geotiff_writer.h.

◆ mapOrigInGeotiff

Eigen::Vector2f hector_geotiff::GeotiffWriter::mapOrigInGeotiff
protected

Definition at line 111 of file geotiff_writer.h.

◆ maxCoordsMap

Eigen::Vector2i hector_geotiff::GeotiffWriter::maxCoordsMap
protected

Definition at line 96 of file geotiff_writer.h.

◆ minCoordsMap

Eigen::Vector2i hector_geotiff::GeotiffWriter::minCoordsMap
protected

Definition at line 95 of file geotiff_writer.h.

◆ origin

Eigen::Vector2f hector_geotiff::GeotiffWriter::origin
protected

Definition at line 84 of file geotiff_writer.h.

◆ pixelsPerGeoTiffMeter

float hector_geotiff::GeotiffWriter::pixelsPerGeoTiffMeter
protected

Definition at line 93 of file geotiff_writer.h.

◆ pixelsPerMapMeter

float hector_geotiff::GeotiffWriter::pixelsPerMapMeter
protected

Definition at line 92 of file geotiff_writer.h.

◆ resolution

float hector_geotiff::GeotiffWriter::resolution
protected

Definition at line 83 of file geotiff_writer.h.

◆ resolutionFactor

int hector_geotiff::GeotiffWriter::resolutionFactor
protected

Definition at line 86 of file geotiff_writer.h.

◆ resolutionFactorf

float hector_geotiff::GeotiffWriter::resolutionFactorf
protected

Definition at line 87 of file geotiff_writer.h.

◆ rightBottomMarginMeters

Eigen::Vector2f hector_geotiff::GeotiffWriter::rightBottomMarginMeters
protected

Definition at line 101 of file geotiff_writer.h.

◆ rightBottomMarginPixels

Eigen::Vector2i hector_geotiff::GeotiffWriter::rightBottomMarginPixels
protected

Definition at line 103 of file geotiff_writer.h.

◆ rightBottomMarginPixelsf

Eigen::Vector2f hector_geotiff::GeotiffWriter::rightBottomMarginPixelsf
protected

Definition at line 102 of file geotiff_writer.h.

◆ sizeMap

Eigen::Vector2i hector_geotiff::GeotiffWriter::sizeMap
protected

Definition at line 98 of file geotiff_writer.h.

◆ sizeMapf

Eigen::Vector2f hector_geotiff::GeotiffWriter::sizeMapf
protected

Definition at line 99 of file geotiff_writer.h.

◆ totalMeters

Eigen::Vector2f hector_geotiff::GeotiffWriter::totalMeters
protected

Definition at line 107 of file geotiff_writer.h.

◆ use_utc_time_suffix_

bool hector_geotiff::GeotiffWriter::use_utc_time_suffix_
protected

Definition at line 90 of file geotiff_writer.h.

◆ useCheckerboardCache

bool hector_geotiff::GeotiffWriter::useCheckerboardCache
protected

Definition at line 89 of file geotiff_writer.h.

◆ world_geo_transformer_

HectorMapTools::CoordinateTransformer<float> hector_geotiff::GeotiffWriter::world_geo_transformer_
protected

Definition at line 124 of file geotiff_writer.h.

◆ world_map_transformer_

HectorMapTools::CoordinateTransformer<float> hector_geotiff::GeotiffWriter::world_map_transformer_
protected

Definition at line 122 of file geotiff_writer.h.


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


hector_geotiff
Author(s): Stefan Kohlbrecher
autogenerated on Sat Mar 12 2022 03:57:53