| _aBackfaceCulling | rtabmap::CloudViewer | private |
| _aCameraOrtho | rtabmap::CloudViewer | private |
| _aClearTrajectory | rtabmap::CloudViewer | private |
| _addedClouds | rtabmap::CloudViewer | private |
| _aFollowCamera | rtabmap::CloudViewer | private |
| _aLockCamera | rtabmap::CloudViewer | private |
| _aLockViewZ | rtabmap::CloudViewer | private |
| _aPolygonPicking | rtabmap::CloudViewer | private |
| _aResetCamera | rtabmap::CloudViewer | private |
| _aSetBackgroundColor | rtabmap::CloudViewer | private |
| _aSetEdgeVisibility | rtabmap::CloudViewer | private |
| _aSetEDLShading | rtabmap::CloudViewer | private |
| _aSetFlatShading | rtabmap::CloudViewer | private |
| _aSetFrameScale | rtabmap::CloudViewer | private |
| _aSetFrustumColor | rtabmap::CloudViewer | private |
| _aSetFrustumScale | rtabmap::CloudViewer | private |
| _aSetGridCellCount | rtabmap::CloudViewer | private |
| _aSetGridCellSize | rtabmap::CloudViewer | private |
| _aSetIntensityMaximum | rtabmap::CloudViewer | private |
| _aSetIntensityRainbowColormap | rtabmap::CloudViewer | private |
| _aSetIntensityRedColormap | rtabmap::CloudViewer | private |
| _aSetLighting | rtabmap::CloudViewer | private |
| _aSetNormalsScale | rtabmap::CloudViewer | private |
| _aSetNormalsStep | rtabmap::CloudViewer | private |
| _aSetRenderingRate | rtabmap::CloudViewer | private |
| _aSetTrajectorySize | rtabmap::CloudViewer | private |
| _aShowCameraAxis | rtabmap::CloudViewer | private |
| _aShowFrustum | rtabmap::CloudViewer | private |
| _aShowGrid | rtabmap::CloudViewer | private |
| _aShowNormals | rtabmap::CloudViewer | private |
| _aShowTrajectory | rtabmap::CloudViewer | private |
| _buildLocator | rtabmap::CloudViewer | private |
| _coordinateFrameScale | rtabmap::CloudViewer | private |
| _coordinates | rtabmap::CloudViewer | private |
| _cubes | rtabmap::CloudViewer | private |
| _currentBgColor | rtabmap::CloudViewer | private |
| _defaultBgColor | rtabmap::CloudViewer | private |
| _frontfaceCulling | rtabmap::CloudViewer | private |
| _frustumColor | rtabmap::CloudViewer | private |
| _frustums | rtabmap::CloudViewer | private |
| _frustumScale | rtabmap::CloudViewer | private |
| _graphes | rtabmap::CloudViewer | private |
| _gridCellCount | rtabmap::CloudViewer | private |
| _gridCellSize | rtabmap::CloudViewer | private |
| _gridLines | rtabmap::CloudViewer | private |
| _intensityAbsMax | rtabmap::CloudViewer | private |
| _keysPressed | rtabmap::CloudViewer | private |
| _lastCameraOrientation | rtabmap::CloudViewer | private |
| _lastCameraPose | rtabmap::CloudViewer | private |
| _lastPose | rtabmap::CloudViewer | private |
| _lines | rtabmap::CloudViewer | private |
| _locators | rtabmap::CloudViewer | private |
| _maxTrajectorySize | rtabmap::CloudViewer | private |
| _menu | rtabmap::CloudViewer | private |
| _normalsScale | rtabmap::CloudViewer | private |
| _normalsStep | rtabmap::CloudViewer | private |
| _octomapActor | rtabmap::CloudViewer | private |
| _quads | rtabmap::CloudViewer | private |
| _renderingRate | rtabmap::CloudViewer | private |
| _spheres | rtabmap::CloudViewer | private |
| _texts | rtabmap::CloudViewer | private |
| _trajectory | rtabmap::CloudViewer | private |
| _visualizer | rtabmap::CloudViewer | private |
| addCloud(const std::string &id, const pcl::PCLPointCloud2Ptr &binaryCloud, const Transform &pose, bool rgb, bool hasNormals, bool hasIntensity, const QColor &color=QColor(), int viewport=1) | rtabmap::CloudViewer | |
| addCloud(const std::string &id, const pcl::PointCloud< pcl::PointXYZRGBNormal >::Ptr &cloud, const Transform &pose=Transform::getIdentity(), const QColor &color=QColor()) | rtabmap::CloudViewer | |
| addCloud(const std::string &id, const pcl::PointCloud< pcl::PointXYZRGB >::Ptr &cloud, const Transform &pose=Transform::getIdentity(), const QColor &color=QColor()) | rtabmap::CloudViewer | |
| addCloud(const std::string &id, const pcl::PointCloud< pcl::PointXYZINormal >::Ptr &cloud, const Transform &pose=Transform::getIdentity(), const QColor &color=QColor()) | rtabmap::CloudViewer | |
| addCloud(const std::string &id, const pcl::PointCloud< pcl::PointXYZI >::Ptr &cloud, const Transform &pose=Transform::getIdentity(), const QColor &color=QColor()) | rtabmap::CloudViewer | |
| addCloud(const std::string &id, const pcl::PointCloud< pcl::PointNormal >::Ptr &cloud, const Transform &pose=Transform::getIdentity(), const QColor &color=QColor()) | rtabmap::CloudViewer | |
| addCloud(const std::string &id, const pcl::PointCloud< pcl::PointXYZ >::Ptr &cloud, const Transform &pose=Transform::getIdentity(), const QColor &color=QColor()) | rtabmap::CloudViewer | |
| addCloudMesh(const std::string &id, const pcl::PointCloud< pcl::PointXYZ >::Ptr &cloud, const std::vector< pcl::Vertices > &polygons, const Transform &pose=Transform::getIdentity()) | rtabmap::CloudViewer | |
| addCloudMesh(const std::string &id, const pcl::PointCloud< pcl::PointXYZRGB >::Ptr &cloud, const std::vector< pcl::Vertices > &polygons, const Transform &pose=Transform::getIdentity()) | rtabmap::CloudViewer | |
| addCloudMesh(const std::string &id, const pcl::PointCloud< pcl::PointXYZRGBNormal >::Ptr &cloud, const std::vector< pcl::Vertices > &polygons, const Transform &pose=Transform::getIdentity()) | rtabmap::CloudViewer | |
| addCloudMesh(const std::string &id, const pcl::PolygonMesh::Ptr &mesh, const Transform &pose=Transform::getIdentity()) | rtabmap::CloudViewer | |
| addCloudTextureMesh(const std::string &id, const pcl::TextureMesh::Ptr &textureMesh, const cv::Mat &texture, const Transform &pose=Transform::getIdentity()) | rtabmap::CloudViewer | |
| addGrid() | rtabmap::CloudViewer | private |
| addOccupancyGridMap(const cv::Mat &map8U, float resolution, float xMin, float yMin, float opacity) | rtabmap::CloudViewer | |
| addOctomap(const OctoMap *octomap, unsigned int treeDepth=0, bool volumeRepresentation=true) | rtabmap::CloudViewer | |
| addOrUpdateCoordinate(const std::string &id, const Transform &transform, double scale, bool foreground=false) | rtabmap::CloudViewer | |
| addOrUpdateCube(const std::string &id, const Transform &pose, float width, float height, float depth, const QColor &color, bool wireframe=false, bool foreground=false) | rtabmap::CloudViewer | |
| addOrUpdateFrustum(const std::string &id, const Transform &pose, const Transform &localTransform, double scale, const QColor &color=QColor(), float fovX=1.1, float fovY=0.85) | rtabmap::CloudViewer | |
| addOrUpdateGraph(const std::string &id, const pcl::PointCloud< pcl::PointXYZ >::Ptr &graph, const QColor &color=Qt::gray) | rtabmap::CloudViewer | |
| addOrUpdateLine(const std::string &id, const Transform &from, const Transform &to, const QColor &color, bool arrow=false, bool foreground=false) | rtabmap::CloudViewer | |
| addOrUpdateQuad(const std::string &id, const Transform &pose, float width, float height, const QColor &color, bool foreground=false) | rtabmap::CloudViewer | |
| addOrUpdateQuad(const std::string &id, const Transform &pose, float widthLeft, float widthRight, float heightBottom, float heightTop, const QColor &color, bool foreground=false) | rtabmap::CloudViewer | |
| addOrUpdateSphere(const std::string &id, const Transform &pose, float radius, const QColor &color, bool foreground=false) | rtabmap::CloudViewer | |
| addOrUpdateText(const std::string &id, const std::string &text, const Transform &position, double scale, const QColor &color, bool foreground=true) | rtabmap::CloudViewer | |
| addTextureMesh(const pcl::TextureMesh &mesh, const cv::Mat &texture, const std::string &id="texture", int viewport=0) | rtabmap::CloudViewer | |
| buildPickingLocator(bool enable) | rtabmap::CloudViewer | |
| clear() | rtabmap::CloudViewer | virtualslot |
| clearTrajectory() | rtabmap::CloudViewer | |
| CloudViewer(QWidget *parent=0, CloudViewerInteractorStyle *style=CloudViewerInteractorStyle::New()) | rtabmap::CloudViewer | |
| configChanged() | rtabmap::CloudViewer | signal |
| contextMenuEvent(QContextMenuEvent *event) | rtabmap::CloudViewer | protectedvirtual |
| createMenu() | rtabmap::CloudViewer | private |
| getAddedClouds() const | rtabmap::CloudViewer | inline |
| getAddedCoordinates() const | rtabmap::CloudViewer | inline |
| getAddedCubes() const | rtabmap::CloudViewer | inline |
| getAddedFrustums() const | rtabmap::CloudViewer | inline |
| getAddedLines() const | rtabmap::CloudViewer | inline |
| getAddedQuads() const | rtabmap::CloudViewer | inline |
| getAddedSpheres() const | rtabmap::CloudViewer | inline |
| getAddedTexts() const | rtabmap::CloudViewer | inline |
| getBackgroundColor() const | rtabmap::CloudViewer | |
| getCameraPosition(float &x, float &y, float &z, float &focalX, float &focalY, float &focalZ, float &upX, float &upY, float &upZ) const | rtabmap::CloudViewer | |
| getCloudVisibility(const std::string &id) | rtabmap::CloudViewer | |
| getColor(const std::string &id) | rtabmap::CloudViewer | |
| getCoordinateFrameScale() const | rtabmap::CloudViewer | |
| getDefaultBackgroundColor() const | rtabmap::CloudViewer | |
| getFrustumColor() const | rtabmap::CloudViewer | |
| getFrustumScale() const | rtabmap::CloudViewer | |
| getGridCellCount() const | rtabmap::CloudViewer | |
| getGridCellSize() const | rtabmap::CloudViewer | |
| getIdByActor(vtkProp *actor) const | rtabmap::CloudViewer | |
| getIntensityMax() const | rtabmap::CloudViewer | |
| getLocators() const | rtabmap::CloudViewer | inline |
| getNormalsScale() const | rtabmap::CloudViewer | |
| getNormalsStep() const | rtabmap::CloudViewer | |
| getPose(const std::string &id, Transform &pose) | rtabmap::CloudViewer | |
| getRenderingRate() const | rtabmap::CloudViewer | |
| getTargetPose() const | rtabmap::CloudViewer | |
| getTrajectorySize() const | rtabmap::CloudViewer | |
| handleAction(QAction *event) | rtabmap::CloudViewer | protectedvirtual |
| isBackfaceCulling() const | rtabmap::CloudViewer | |
| isCameraAxisShown() const | rtabmap::CloudViewer | |
| isCameraFree() const | rtabmap::CloudViewer | |
| isCameraLockZ() const | rtabmap::CloudViewer | |
| isCameraOrtho() const | rtabmap::CloudViewer | |
| isCameraTargetFollow() const | rtabmap::CloudViewer | |
| isCameraTargetLocked() const | rtabmap::CloudViewer | |
| isEdgeVisible() const | rtabmap::CloudViewer | |
| isEDLShadingOn() const | rtabmap::CloudViewer | |
| isFrontfaceCulling() const | rtabmap::CloudViewer | |
| isFrustumShown() const | rtabmap::CloudViewer | |
| isGridShown() const | rtabmap::CloudViewer | |
| isIntensityRainbowColormap() const | rtabmap::CloudViewer | |
| isIntensityRedColormap() const | rtabmap::CloudViewer | |
| isLightingOn() const | rtabmap::CloudViewer | |
| isNormalsShown() const | rtabmap::CloudViewer | |
| isPolygonPicking() const | rtabmap::CloudViewer | |
| isShadingOn() const | rtabmap::CloudViewer | |
| isTrajectoryShown() const | rtabmap::CloudViewer | |
| keyPressEvent(QKeyEvent *event) | rtabmap::CloudViewer | protectedvirtual |
| keyReleaseEvent(QKeyEvent *event) | rtabmap::CloudViewer | protectedvirtual |
| loadSettings(QSettings &settings, const QString &group="") | rtabmap::CloudViewer | |
| menu() | rtabmap::CloudViewer | inlineprotected |
| mouseMoveEvent(QMouseEvent *event) | rtabmap::CloudViewer | protectedvirtual |
| mousePressEvent(QMouseEvent *event) | rtabmap::CloudViewer | protectedvirtual |
| removeAllClouds() | rtabmap::CloudViewer | |
| removeAllCoordinates(const std::string &prefix="") | rtabmap::CloudViewer | |
| removeAllCubes() | rtabmap::CloudViewer | |
| removeAllFrustums(bool exceptCameraReference=false) | rtabmap::CloudViewer | |
| removeAllGraphs() | rtabmap::CloudViewer | |
| removeAllLines() | rtabmap::CloudViewer | |
| removeAllQuads() | rtabmap::CloudViewer | |
| removeAllSpheres() | rtabmap::CloudViewer | |
| removeAllTexts() | rtabmap::CloudViewer | |
| removeCloud(const std::string &id) | rtabmap::CloudViewer | |
| removeCoordinate(const std::string &id) | rtabmap::CloudViewer | |
| removeCube(const std::string &id) | rtabmap::CloudViewer | |
| removeFrustum(const std::string &id) | rtabmap::CloudViewer | |
| removeGraph(const std::string &id) | rtabmap::CloudViewer | |
| removeGrid() | rtabmap::CloudViewer | private |
| removeLine(const std::string &id) | rtabmap::CloudViewer | |
| removeOccupancyGridMap() | rtabmap::CloudViewer | |
| removeOctomap() | rtabmap::CloudViewer | |
| removeQuad(const std::string &id) | rtabmap::CloudViewer | |
| removeSphere(const std::string &id) | rtabmap::CloudViewer | |
| removeText(const std::string &id) | rtabmap::CloudViewer | |
| resetCamera() | rtabmap::CloudViewer | |
| saveSettings(QSettings &settings, const QString &group="") const | rtabmap::CloudViewer | |
| setBackfaceCulling(bool enabled, bool frontfaceCulling) | rtabmap::CloudViewer | |
| setBackgroundColor(const QColor &color) | rtabmap::CloudViewer | slot |
| setCameraAxisShown(bool shown) | rtabmap::CloudViewer | |
| setCameraFree() | rtabmap::CloudViewer | |
| setCameraLockZ(bool enabled=true) | rtabmap::CloudViewer | |
| setCameraOrtho(bool enabled=true) | rtabmap::CloudViewer | |
| setCameraPosition(float x, float y, float z, float focalX, float focalY, float focalZ, float upX, float upY, float upZ) | rtabmap::CloudViewer | |
| setCameraTargetFollow(bool enabled=true) | rtabmap::CloudViewer | |
| setCameraTargetLocked(bool enabled=true) | rtabmap::CloudViewer | |
| setCloudColorIndex(const std::string &id, int index) | rtabmap::CloudViewer | slot |
| setCloudOpacity(const std::string &id, double opacity=1.0) | rtabmap::CloudViewer | slot |
| setCloudPointSize(const std::string &id, int size) | rtabmap::CloudViewer | slot |
| setCloudVisibility(const std::string &id, bool isVisible) | rtabmap::CloudViewer | slot |
| setColor(const std::string &id, const QColor &color) | rtabmap::CloudViewer | |
| setCoordinateFrameScale(double scale) | rtabmap::CloudViewer | |
| setDefaultBackgroundColor(const QColor &color) | rtabmap::CloudViewer | slot |
| setEdgeVisibility(bool visible) | rtabmap::CloudViewer | |
| setEDLShading(bool on) | rtabmap::CloudViewer | |
| setFrustumColor(QColor value) | rtabmap::CloudViewer | |
| setFrustumScale(float value) | rtabmap::CloudViewer | |
| setFrustumShown(bool shown) | rtabmap::CloudViewer | |
| setGridCellCount(unsigned int count) | rtabmap::CloudViewer | |
| setGridCellSize(float size) | rtabmap::CloudViewer | |
| setGridShown(bool shown) | rtabmap::CloudViewer | |
| setIntensityMax(float value) | rtabmap::CloudViewer | |
| setIntensityRainbowColormap(bool value) | rtabmap::CloudViewer | |
| setIntensityRedColormap(bool value) | rtabmap::CloudViewer | |
| setInteractorLayer(int layer) | rtabmap::CloudViewer | |
| setLighting(bool on) | rtabmap::CloudViewer | |
| setNormalsScale(float scale) | rtabmap::CloudViewer | |
| setNormalsShown(bool shown) | rtabmap::CloudViewer | |
| setNormalsStep(int step) | rtabmap::CloudViewer | |
| setPolygonPicking(bool enabled) | rtabmap::CloudViewer | |
| setRenderingRate(double rate) | rtabmap::CloudViewer | |
| setShading(bool on) | rtabmap::CloudViewer | |
| setTrajectoryShown(bool shown) | rtabmap::CloudViewer | |
| setTrajectorySize(unsigned int value) | rtabmap::CloudViewer | |
| updateCameraFrustum(const Transform &pose, const StereoCameraModel &model) | rtabmap::CloudViewer | |
| updateCameraFrustum(const Transform &pose, const CameraModel &model) | rtabmap::CloudViewer | |
| updateCameraFrustums(const Transform &pose, const std::vector< CameraModel > &models) | rtabmap::CloudViewer | |
| updateCameraTargetPosition(const Transform &pose) | rtabmap::CloudViewer | |
| updateCloudPose(const std::string &id, const Transform &pose) | rtabmap::CloudViewer | |
| updateCoordinatePose(const std::string &id, const Transform &transform) | rtabmap::CloudViewer | |
| updateFrustumPose(const std::string &id, const Transform &pose) | rtabmap::CloudViewer | |
| visualizer() | rtabmap::CloudViewer | inlineprotected |
| wheelEvent(QWheelEvent *event) | rtabmap::CloudViewer | protectedvirtual |
| ~CloudViewer() | rtabmap::CloudViewer | virtual |