Public Member Functions | Static Public Attributes | Private Types | Private Member Functions | Private Attributes
MapView Class Reference

#include <MapView.h>

Inheritance diagram for MapView:
Inheritance graph
[legend]

List of all members.

Public Member Functions

bool handleCommand (std::string s)
 MapView (DroneKalmanFilter *f, PTAMWrapper *p, EstimationNode *nde)
void on_key_down (int key)
void Reset ()
void resetMapView ()
void startSystem ()
void stopSystem ()
 ~MapView (void)

Static Public Attributes

static pthread_mutex_t trailPointsVec_CS = PTHREAD_MUTEX_INITIALIZER

Private Types

enum  { UI_NONE = 0, UI_DEBUG = 1, UI_PRES = 2 }

Private Member Functions

void control ()
void drawTrail ()
void plotCam (TooN::SE3<> droneToGlobal, bool xyCross, float thick, float len, float alpha)
void plotGrid ()
void plotKeyframes ()
void plotMapPoints ()
void Render ()
void ResetInternal ()
void run ()
void SetupFrustum ()
void SetupModelView (TooN::SE3<> se3WorldFromCurrent=TooN::SE3<>())

Private Attributes

bool changeSizeNextRender
char charBuf [1000]
bool clearTrail
CVD::ImageRef defaultWindowSize
CVD::ImageRef desiredWindowSize
enum MapView:: { ... }  drawUI
DroneKalmanFilterfilter
bool inControl
bool keepRunning
TooN::Vector< 10 > lastFramePoseSpeed
float lineWidthFactor
TooN::SE3 mse3ViewerFromWorld
std::string msg
TooN::Vector< 3 > mv3MassCenter
GLWindow2myGLWindow
EstimationNodenode
PredictorpredConvert
PTAMWrapperptamWrapper
bool resetMapViewFlag
bool resetRequested
std::vector< TrailPointtrailPoints

Detailed Description

Definition at line 58 of file MapView.h.


Member Enumeration Documentation

anonymous enum [private]
Enumerator:
UI_NONE 
UI_DEBUG 
UI_PRES 

Definition at line 94 of file MapView.h.


Constructor & Destructor Documentation

Definition at line 33 of file MapView.cpp.

MapView::~MapView ( void  )

Definition at line 53 of file MapView.cpp.


Member Function Documentation

void MapView::control ( ) [private]
void MapView::drawTrail ( ) [private]

Definition at line 296 of file MapView.cpp.

bool MapView::handleCommand ( std::string  s)

Definition at line 596 of file MapView.cpp.

void MapView::on_key_down ( int  key) [virtual]

Reimplemented from MouseKeyHandler.

Definition at line 569 of file MapView.cpp.

void MapView::plotCam ( TooN::SE3<>  droneToGlobal,
bool  xyCross,
float  thick,
float  len,
float  alpha 
) [private]

Definition at line 380 of file MapView.cpp.

void MapView::plotGrid ( ) [private]

Definition at line 445 of file MapView.cpp.

void MapView::plotKeyframes ( ) [private]
void MapView::plotMapPoints ( ) [private]

Definition at line 339 of file MapView.cpp.

void MapView::Render ( ) [private]

Definition at line 90 of file MapView.cpp.

void MapView::Reset ( ) [inline]

Definition at line 131 of file MapView.h.

void MapView::ResetInternal ( ) [private]

Definition at line 47 of file MapView.cpp.

Definition at line 440 of file MapView.cpp.

void MapView::run ( ) [private]

Definition at line 74 of file MapView.cpp.

void MapView::SetupFrustum ( ) [private]

Definition at line 551 of file MapView.cpp.

void MapView::SetupModelView ( TooN::SE3<>  se3WorldFromCurrent = TooN::SE3<>()) [private]

Definition at line 561 of file MapView.cpp.

Definition at line 59 of file MapView.cpp.

Definition at line 67 of file MapView.cpp.


Member Data Documentation

Definition at line 65 of file MapView.h.

char MapView::charBuf[1000] [private]

Definition at line 92 of file MapView.h.

bool MapView::clearTrail [private]

Definition at line 118 of file MapView.h.

CVD::ImageRef MapView::defaultWindowSize [private]

Definition at line 64 of file MapView.h.

CVD::ImageRef MapView::desiredWindowSize [private]

Definition at line 63 of file MapView.h.

enum { ... } MapView::drawUI [private]

Definition at line 79 of file MapView.h.

bool MapView::inControl [private]

Definition at line 117 of file MapView.h.

bool MapView::keepRunning [private]

Definition at line 86 of file MapView.h.

TooN::Vector<10> MapView::lastFramePoseSpeed [private]

Definition at line 116 of file MapView.h.

float MapView::lineWidthFactor [private]

Definition at line 95 of file MapView.h.

TooN::SE3 MapView::mse3ViewerFromWorld [private]

Definition at line 105 of file MapView.h.

std::string MapView::msg [private]

Definition at line 93 of file MapView.h.

TooN::Vector<3> MapView::mv3MassCenter [private]

Definition at line 106 of file MapView.h.

Definition at line 62 of file MapView.h.

Definition at line 81 of file MapView.h.

Definition at line 88 of file MapView.h.

Definition at line 80 of file MapView.h.

bool MapView::resetMapViewFlag [private]

Definition at line 107 of file MapView.h.

bool MapView::resetRequested [private]

Definition at line 83 of file MapView.h.

std::vector<TrailPoint> MapView::trailPoints [private]

Definition at line 122 of file MapView.h.

pthread_mutex_t MapView::trailPointsVec_CS = PTHREAD_MUTEX_INITIALIZER [static]

This file is part of tum_ardrone.

Copyright 2012 Jakob Engel <jajuengel@gmail.com> (Technical University of Munich) For more information see <https://vision.in.tum.de/data/software/tum_ardrone>.

tum_ardrone is free software: you can redistribute it and/or modify it under the terms of the GNU General Public License as published by the Free Software Foundation, either version 3 of the License, or (at your option) any later version.

tum_ardrone is distributed in the hope that it will be useful, but WITHOUT ANY WARRANTY; without even the implied warranty of MERCHANTABILITY or FITNESS FOR A PARTICULAR PURPOSE. See the GNU General Public License for more details.

You should have received a copy of the GNU General Public License along with tum_ardrone. If not, see <http://www.gnu.org/licenses/>.

Definition at line 141 of file MapView.h.


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


tum_ardrone
Author(s):
autogenerated on Sat Jun 8 2019 20:27:23