addEnvSensor(int type, float value) | RTABMapApp | |
appendMode_ | RTABMapApp | private |
backgroundColor_ | RTABMapApp | private |
bilateralFilteringOnNextRender_ | RTABMapApp | private |
bufferedStatsData_ | RTABMapApp | private |
camera_ | RTABMapApp | private |
cameraColor_ | RTABMapApp | private |
cameraDriver_ | RTABMapApp | private |
cameraJustInitialized_ | RTABMapApp | private |
cameraMutex_ | RTABMapApp | private |
cancelProcessing() | RTABMapApp | |
clearSceneOnNextRender_ | RTABMapApp | private |
cloudDensityLevel_ | RTABMapApp | private |
clusterRatio_ | RTABMapApp | private |
createdMeshes_ | RTABMapApp | private |
dataRecorderMode_ | RTABMapApp | private |
depthConfidence_ | RTABMapApp | private |
depthFromMotion_ | RTABMapApp | private |
exportedMeshUpdated_ | RTABMapApp | private |
exporting_ | RTABMapApp | private |
exportMesh(float cloudVoxelSize, bool regenerateCloud, bool meshing, int textureSize, int textureCount, int normalK, bool optimized, float optimizedVoxelSize, int optimizedDepth, int optimizedMaxPolygons, float optimizedColorRadius, bool optimizedCleanWhitePolygons, int optimizedMinClusterSize, float optimizedMaxTextureDistance, int optimizedMinTextureClusterSize, bool blockRendering) | RTABMapApp | |
filterOrganizedPolygons(const std::vector< pcl::Vertices > &polygons, int cloudSize) const | RTABMapApp | private |
filterPolygons(const std::vector< pcl::Vertices > &polygons, int cloudSize) const | RTABMapApp | private |
filterPolygonsOnNextRender_ | RTABMapApp | private |
fpsTime_ | RTABMapApp | private |
fullResolution_ | RTABMapApp | private |
gainCompensation(bool full=false) | RTABMapApp | private |
gainCompensationOnNextRender_ | RTABMapApp | private |
getRtabmapParameters() | RTABMapApp | private |
graphOptimization_ | RTABMapApp | private |
handleEvent(UEvent *event) | RTABMapApp | protectedvirtual |
InitializeGLContent() | RTABMapApp | |
isBuiltWith(int cameraDriver) const | RTABMapApp | |
lastDrawnCloudsCount_ | RTABMapApp | private |
lastPoseEventTime_ | RTABMapApp | private |
lastPostRenderEventTime_ | RTABMapApp | private |
localizationMode_ | RTABMapApp | private |
logHandler_ | RTABMapApp | private |
main_scene_ | RTABMapApp | private |
mappingParameters_ | RTABMapApp | private |
mapToOdom_ | RTABMapApp | private |
maxCloudDepth_ | RTABMapApp | private |
maxGainRadius_ | RTABMapApp | private |
meshAngleToleranceDeg_ | RTABMapApp | private |
meshDecimationFactor_ | RTABMapApp | private |
meshesMutex_ | RTABMapApp | private |
meshTrianglePix_ | RTABMapApp | private |
minCloudDepth_ | RTABMapApp | private |
nodesFiltering_ | RTABMapApp | private |
odomCloudShown_ | RTABMapApp | private |
OnTouchEvent(int touch_count, tango_gl::GestureCamera::TouchEvent event, float x0, float y0, float x1, float y1) | RTABMapApp | |
openDatabase(const std::string &databasePath, bool databaseInMemory, bool optimize, bool clearDatabase) | RTABMapApp | |
openingDatabase_ | RTABMapApp | private |
optMesh_ | RTABMapApp | private |
optRefId_ | RTABMapApp | private |
optRefPose_ | RTABMapApp | private |
optTexture_ | RTABMapApp | private |
poseEvents_ | RTABMapApp | private |
poseMutex_ | RTABMapApp | private |
post(UEvent *event, bool async=true) const | UEventsSender | protected |
postCameraPoseEvent(float x, float y, float z, float qx, float qy, float qz, float qw, double stamp) | RTABMapApp | |
postExportation(bool visualize) | RTABMapApp | |
postOdometryEvent(rtabmap::Transform pose, float rgb_fx, float rgb_fy, float rgb_cx, float rgb_cy, float depth_fx, float depth_fy, float depth_cx, float depth_cy, const rtabmap::Transform &rgbFrame, const rtabmap::Transform &depthFrame, double stamp, double depthStamp, const void *yPlane, const void *uPlane, const void *vPlane, int yPlaneLen, int rgbWidth, int rgbHeight, int rgbFormat, const void *depth, int depthLen, int depthWidth, int depthHeight, int depthFormat, const void *conf, int confLen, int confWidth, int confHeight, int confFormat, const float *points, int pointsLen, int pointsChannels, const rtabmap::Transform &viewMatrix, float p00, float p11, float p02, float p12, float p22, float p32, float p23, float t0, float t1, float t2, float t3, float t4, float t5, float t6, float t7) | RTABMapApp | |
postProcessing(int approach) | RTABMapApp | |
postProcessing_ | RTABMapApp | private |
progressionStatus_ | RTABMapApp | private |
rawPoses_ | RTABMapApp | private |
rawScanSaved_ | RTABMapApp | private |
recover(const std::string &from, const std::string &to) | RTABMapApp | |
registerToEventsManager() | UEventsHandler | |
Render() | RTABMapApp | |
renderingMutex_ | RTABMapApp | private |
renderingTextureDecimation_ | RTABMapApp | private |
renderingTime_ | RTABMapApp | private |
rtabmap_ | RTABMapApp | private |
RTABMapApp() | RTABMapApp | |
rtabmapEvents_ | RTABMapApp | private |
rtabmapMutex_ | RTABMapApp | private |
rtabmapThread_ | RTABMapApp | private |
save(const std::string &databasePath) | RTABMapApp | |
screenshotReady_ | RTABMapApp | private |
sensorCaptureThread_ | RTABMapApp | private |
sensorEvents_ | RTABMapApp | private |
sensorMutex_ | RTABMapApp | private |
setAppendMode(bool enabled) | RTABMapApp | |
setBackfaceCulling(bool enabled) | RTABMapApp | |
setBackgroundColor(float gray) | RTABMapApp | |
setCameraColor(bool enabled) | RTABMapApp | |
SetCameraType(tango_gl::GestureCamera::CameraType camera_type) | RTABMapApp | |
setCloudDensityLevel(int value) | RTABMapApp | |
setClusterRatio(float value) | RTABMapApp | |
setDataRecorderMode(bool enabled) | RTABMapApp | |
setDepthConfidence(int value) | RTABMapApp | |
setDepthFromMotion(bool enabled) | RTABMapApp | |
setFOV(float angle) | RTABMapApp | |
setFullResolution(bool enabled) | RTABMapApp | |
setGPS(const rtabmap::GPS &gps) | RTABMapApp | |
setGraphOptimization(bool enabled) | RTABMapApp | |
setGraphVisible(bool visible) | RTABMapApp | |
setGridRotation(float value) | RTABMapApp | |
setGridVisible(bool visible) | RTABMapApp | |
setLighting(bool enabled) | RTABMapApp | |
setLocalizationMode(bool enabled) | RTABMapApp | |
setMapCloudShown(bool shown) | RTABMapApp | |
setMappingParameter(const std::string &key, const std::string &value) | RTABMapApp | |
setMaxCloudDepth(float value) | RTABMapApp | |
setMaxGainRadius(float value) | RTABMapApp | |
setMeshAngleTolerance(float value) | RTABMapApp | |
setMeshDecimationFactor(float value) | RTABMapApp | |
setMeshRendering(bool enabled, bool withTexture) | RTABMapApp | |
setMeshTriangleSize(int value) | RTABMapApp | |
setMinCloudDepth(float value) | RTABMapApp | |
setNodesFiltering(bool enabled) | RTABMapApp | |
setOdomCloudShown(bool shown) | RTABMapApp | |
setOnlineBlending(bool enabled) | RTABMapApp | |
setOrthoCropFactor(float value) | RTABMapApp | |
setPausedMapping(bool paused) | RTABMapApp | |
setPointSize(float value) | RTABMapApp | |
setRawScanSaved(bool enabled) | RTABMapApp | |
setRenderingTextureDecimation(int value) | RTABMapApp | |
setScreenRotation(int displayRotation, int cameraRotation) | RTABMapApp | |
setSmoothing(bool enabled) | RTABMapApp | |
setTrajectoryMode(bool enabled) | RTABMapApp | |
setupSwiftCallbacks(void *classPtr, void(*progressCallback)(void *, int, int), void(*initCallback)(void *, int, const char *), void(*statsUpdatedCallback)(void *, int, int, int, int, float, int, int, int, int, int, int, float, int, float, int, float, float, float, float, int, int, float, float, float, float, float, float)) | RTABMapApp | |
SetViewPort(int width, int height) | RTABMapApp | |
setWireframe(bool enabled) | RTABMapApp | |
smoothing_ | RTABMapApp | private |
smoothMesh(int id, rtabmap::Mesh &mesh) | RTABMapApp | private |
startCamera() | RTABMapApp | |
status_ | RTABMapApp | private |
stopCamera() | RTABMapApp | |
swiftClassPtr_ | RTABMapApp | private |
swiftInitCallback | RTABMapApp | private |
swiftStatsUpdatedCallback | RTABMapApp | private |
takeScreenshotOnNextRender_ | RTABMapApp | private |
totalPoints_ | RTABMapApp | private |
totalPolygons_ | RTABMapApp | private |
trajectoryMode_ | RTABMapApp | private |
UEventsHandler() | UEventsHandler | inlineprotected |
UEventsSender() | UEventsSender | inline |
unregisterFromEventsManager() | UEventsHandler | |
updateMeshDecimation(int width, int height) | RTABMapApp | private |
useExternalLidar_ | RTABMapApp | private |
visualizingMesh_ | RTABMapApp | private |
writeExportedMesh(const std::string &directory, const std::string &name) | RTABMapApp | |
~RTABMapApp() | RTABMapApp | |
~UEventsHandler() | UEventsHandler | protectedvirtual |
~UEventsSender() | UEventsSender | virtual |