glviewer2.cpp
Go to the documentation of this file.
00001 /* This file is part of RGBDSLAM.
00002  * 
00003  * RGBDSLAM is free software: you can redistribute it and/or modify
00004  * it under the terms of the GNU General Public License as published by
00005  * the Free Software Foundation, either version 3 of the License, or
00006  * (at your option) any later version.
00007  * 
00008  * RGBDSLAM is distributed in the hope that it will be useful,
00009  * but WITHOUT ANY WARRANTY; without even the implied warranty of
00010  * MERCHANTABILITY or FITNESS FOR A PARTICULAR PURPOSE.  See the
00011  * GNU General Public License for more details.
00012  * 
00013  * You should have received a copy of the GNU General Public License
00014  * along with RGBDSLAM.  If not, see <http://www.gnu.org/licenses/>.
00015  */
00016 
00017 
00018 #include "glviewer.h"
00019 
00020 GLViewer::GLViewer(QWidget *parent) : QWidget(parent) { }
00021 GLViewer::~GLViewer() { }
00022 void GLViewer::initialPosition() { }
00023 QSize GLViewer::minimumSizeHint() const { return QSize(0, 0); }
00024 QSize GLViewer::sizeHint() const { return QSize(0, 0); }
00025 void GLViewer::setXRotation(int angle) { } 
00026 void GLViewer::setYRotation(int angle) { } 
00027 void GLViewer::setZRotation(int angle) { } 
00028 void GLViewer::setRotationGrid(double rot_step_in_degree) { } 
00029 void GLViewer::setStereoShift(double shift) { } 
00030 void GLViewer::initializeGL() { }
00031 void GLViewer::drawTriangle(const point_type& p1, const point_type& p2, const point_type& p3){ }
00032 void GLViewer::drawGrid(){ }
00033 void GLViewer::drawAxes(float scale, float thickness){ }
00034 void GLViewer::makeCurrent(){ }
00035 void GLViewer::paintGL() { }
00036 void GLViewer::drawRenderable() { }
00037 void GLViewer::drawOneCloud(int i) { }
00038 void GLViewer::drawClouds(float xshift) { }
00039 void GLViewer::resizeGL(int width, int height) { }
00040 void GLViewer::mouseDoubleClickEvent(QMouseEvent *event) { }
00041 void GLViewer::toggleStereo(bool flag){ }
00042 void GLViewer::toggleBackgroundColor(bool flag){ }
00043 void GLViewer::toggleShowFeatures(bool flag){ }
00044 void GLViewer::toggleShowOctoMap(bool flag){ }
00045 void GLViewer::toggleShowClouds(bool flag){ }
00046 void GLViewer::toggleShowTFs(bool flag){ }
00047 void GLViewer::toggleShowGrid(bool flag){ }
00048 void GLViewer::toggleShowIDs(bool flag){ }
00049 void GLViewer::toggleShowEdges(bool flag){ }
00050 void GLViewer::toggleShowPoses(bool flag){ }
00051 void GLViewer::toggleFollowMode(bool flag){ }
00052 void GLViewer::mouseReleaseEvent(QMouseEvent *event) { }
00053 void GLViewer::mousePressEvent(QMouseEvent *event) { } 
00054 void GLViewer::wheelEvent(QWheelEvent *event) { }
00055 void GLViewer::mouseMoveEvent(QMouseEvent *event) { } 
00056 void GLViewer::updateTransforms(QList<QMatrix4x4>* transforms){ }
00057 void GLViewer::addPointCloud(pointcloud_type * pc, QMatrix4x4 transform){ }
00058 void GLViewer::addFeatures(const std::vector<Eigen::Vector4f, Eigen::aligned_allocator<Eigen::Vector4f> >* feature_locations_3d) { }
00059 void GLViewer::pointCloud2GLStrip(pointcloud_type * pc){ }
00060 void GLViewer::deleteLastNode(){ }
00061 void GLViewer::pointCloud2GLEllipsoids(pointcloud_type * pc){ }
00062 void GLViewer::pointCloud2GLPoints(pointcloud_type * pc){ }
00063 void GLViewer::pointCloud2GLTriangleList(pointcloud_type const * pc){ }
00064 void GLViewer::reset(){ }
00065 QImage GLViewer::renderList(QMatrix4x4 transform, int list_id){ return QImage(); }
00066 void GLViewer::setEdges(const QList<QPair<int, int> >* edge_list){ } 
00067 void GLViewer::drawEdges(){ } 
00068 void GLViewer::setViewPoint(QMatrix4x4 new_vp){ } 
00069 bool GLViewer::setClickedPosition(int x, int y) { } 
00070 void GLViewer::toggleTriangulation() { } 
00071 void GLViewer::drawToPS(QString filename){ }
00072 void GLViewer::clearAndUpdate(){ }
00073 void GLViewer::drawNavigationAxis(int axis_idx, float scale, QString text){ }
00074 void GLViewer::setRenderable(Renderable* r){ }
00075 


rgbdslam_v2
Author(s): Felix Endres, Juergen Hess, Nikolas Engelhard
autogenerated on Thu Jun 6 2019 21:49:45