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 59 of file MapView.h.


Member Enumeration Documentation

anonymous enum [private]
Enumerator:
UI_NONE 
UI_DEBUG 
UI_PRES 

Definition at line 95 of file MapView.h.


Constructor & Destructor Documentation

Definition at line 34 of file MapView.cpp.

MapView::~MapView ( void  )

Definition at line 54 of file MapView.cpp.


Member Function Documentation

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

Definition at line 297 of file MapView.cpp.

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

Definition at line 597 of file MapView.cpp.

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

Reimplemented from MouseKeyHandler.

Definition at line 570 of file MapView.cpp.

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

Definition at line 381 of file MapView.cpp.

void MapView::plotGrid ( ) [private]

Definition at line 446 of file MapView.cpp.

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

Definition at line 340 of file MapView.cpp.

void MapView::Render ( ) [private]

Definition at line 91 of file MapView.cpp.

void MapView::Reset ( ) [inline]

Definition at line 132 of file MapView.h.

void MapView::ResetInternal ( ) [private]

Definition at line 48 of file MapView.cpp.

Definition at line 441 of file MapView.cpp.

void MapView::run ( ) [private]

Definition at line 75 of file MapView.cpp.

void MapView::SetupFrustum ( ) [private]

Definition at line 552 of file MapView.cpp.

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

Definition at line 562 of file MapView.cpp.

Definition at line 60 of file MapView.cpp.

Definition at line 68 of file MapView.cpp.


Member Data Documentation

Definition at line 66 of file MapView.h.

char MapView::charBuf[1000] [private]

Definition at line 93 of file MapView.h.

bool MapView::clearTrail [private]

Definition at line 119 of file MapView.h.

CVD::ImageRef MapView::defaultWindowSize [private]

Definition at line 65 of file MapView.h.

CVD::ImageRef MapView::desiredWindowSize [private]

Definition at line 64 of file MapView.h.

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

Definition at line 80 of file MapView.h.

bool MapView::inControl [private]

Definition at line 118 of file MapView.h.

bool MapView::keepRunning [private]

Definition at line 87 of file MapView.h.

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

Definition at line 117 of file MapView.h.

float MapView::lineWidthFactor [private]

Definition at line 96 of file MapView.h.

TooN::SE3 MapView::mse3ViewerFromWorld [private]

Definition at line 106 of file MapView.h.

std::string MapView::msg [private]

Definition at line 94 of file MapView.h.

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

Definition at line 107 of file MapView.h.

Definition at line 63 of file MapView.h.

Definition at line 82 of file MapView.h.

Definition at line 89 of file MapView.h.

Definition at line 81 of file MapView.h.

bool MapView::resetMapViewFlag [private]

Definition at line 108 of file MapView.h.

bool MapView::resetRequested [private]

Definition at line 84 of file MapView.h.

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

Definition at line 123 of file MapView.h.

pthread_mutex_t MapView::trailPointsVec_CS = PTHREAD_MUTEX_INITIALIZER [static]

This file is part of uga_tum_ardrone.

Copyright 2012 Jakob Engel <jajuengel@gmail.com> (Technical University of Munich) Portions Copyright 2015 Kenneth Bogert <kbogert@uga.edu> and Sina Solaimanpour <sina@uga.edu> (THINC Lab, University of Georgia) For more information see <https://vision.in.tum.de/data/software/uga_tum_ardrone>.

uga_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.

uga_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 uga_tum_ardrone. If not, see <http://www.gnu.org/licenses/>.

Definition at line 142 of file MapView.h.


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


uga_tum_ardrone
Author(s):
autogenerated on Sat Jun 8 2019 20:30:11