| activity_ | rtabmap::CameraARCore | private |
| addEnvSensor(int type, float value) | rtabmap::CameraMobile | |
| arCameraIntrinsics_ | rtabmap::CameraARCore | private |
| arConfig_ | rtabmap::CameraARCore | private |
| arFrame_ | rtabmap::CameraARCore | private |
| arInstallRequested_ | rtabmap::CameraARCore | private |
| arPose_ | rtabmap::CameraARCore | private |
| arSession_ | rtabmap::CameraARCore | private |
| arSessionMutex_ | rtabmap::CameraARCore | private |
| bilateralFilteringSigmaR | rtabmap::CameraMobile | static |
| bilateralFilteringSigmaS | rtabmap::CameraMobile | static |
| Camera(float imageRate=0, const Transform &localTransform=CameraModel::opticalRotation()) | rtabmap::Camera | protected |
| CameraARCore(void *env, void *context, void *activity, bool depthFromMotion=false, bool smoothing=false) | rtabmap::CameraARCore | |
| CameraMobile(bool smoothing=false) | rtabmap::CameraMobile | |
| captureImage(CameraInfo *info=0) | rtabmap::CameraARCore | protectedvirtual |
| capturePoseOnly() | rtabmap::CameraARCore | protectedvirtual |
| close() | rtabmap::CameraARCore | virtual |
| context_ | rtabmap::CameraARCore | private |
| UThreadC< void >::Create(const Handler &Function, Handle *const &H=0, const bool &CreateDetached=false, const unsigned int &StackSize=0, const bool &CancelEnable=false, const bool &CancelAsync=false) | UThreadC< void > | inlinestatic |
| UThreadC< void >::Create(unsigned long &ThreadId, Handle *const &H=0, const bool &CreateDetached=false, const unsigned int &StackSize=0, const bool &CancelEnable=false, const bool &CancelAsync=false) const | UThreadC< void > | inline |
| currentThreadId() | UThread | inlinestatic |
| depthFromMotion_ | rtabmap::CameraARCore | private |
| UThreadC< void >::Detach(const Handle &H) | UThreadC< void > | inlinestatic |
| deviceTColorCamera_ | rtabmap::CameraMobile | protected |
| env_ | rtabmap::CameraARCore | private |
| Exit() | UThreadC< void > | inlineprotectedstatic |
| Exit() | UThreadC< void > | inlineprotectedstatic |
| getCameraModel() const | rtabmap::CameraMobile | inline |
| getDeviceTColorCamera() const | rtabmap::CameraMobile | inline |
| getImageRate() const | rtabmap::Camera | inline |
| getLocalTransform() const | rtabmap::Camera | inline |
| getNextSeqID() | rtabmap::Camera | inlineprotected |
| getOcclusionImage(CameraModel *model=0) const | rtabmap::CameraARCore | inline |
| getOriginOffset() const | rtabmap::CameraMobile | inline |
| getPoseAtTimestamp(double timestamp) | rtabmap::CameraARCore | private |
| getSerial() const | rtabmap::CameraARCore | virtual |
| getTextureId() const | rtabmap::CameraARCore | inline |
| getThreadHandle() const | UThread | inline |
| getThreadId() const | UThread | inline |
| getVPMatrices(glm::mat4 &view, glm::mat4 &projection) const | rtabmap::CameraARCore | inline |
| Handle typedef | UThreadC< void > | |
| Handle typedef | UThreadC< void > | |
| Handler typedef | UThreadC< void > | |
| Handler typedef | UThreadC< void > | |
| imageCallback(AImageReader *reader) | rtabmap::CameraARCore | |
| init(const std::string &calibrationFolder=".", const std::string &cameraName="") | rtabmap::CameraARCore | virtual |
| initFromFile(const std::string &calibrationPath) | rtabmap::Camera | |
| isCalibrated() const | rtabmap::CameraMobile | virtual |
| isCreating() const | UThread | |
| isIdle() const | UThread | |
| isKilled() const | UThread | |
| isRunning() const | UThread | |
| join(bool killFirst=false) | UThread | |
| UThreadC< void >::Join(const Handle &H) | UThreadC< void > | inlinestatic |
| UThreadC< void >::Kill(const Handle &H) | UThreadC< void > | inlinestatic |
| kill() | UThread | |
| kPAboveNormal enum value | UThread | |
| kPBelowNormal enum value | UThread | |
| kPLow enum value | UThread | |
| kPNormal enum value | UThread | |
| kPRealTime enum value | UThread | |
| mainLoop() | rtabmap::CameraMobile | protectedvirtual |
| mainLoopBegin() | rtabmap::CameraMobile | protectedvirtual |
| model_ | rtabmap::CameraMobile | protected |
| occlusionImage_ | rtabmap::CameraARCore | private |
| occlusionModel_ | rtabmap::CameraARCore | private |
| odomProvided() const | rtabmap::Camera | inlinevirtual |
| opticalRotation | rtabmap::CameraMobile | static |
| opticalRotationInv | rtabmap::CameraMobile | static |
| poseReceived(const Transform &pose) | rtabmap::CameraMobile | |
| post(UEvent *event, bool async=true) const | UEventsSender | protected |
| Priority enum name | UThread | |
| projectionMatrix_ | rtabmap::CameraARCore | private |
| resetOrigin() | rtabmap::CameraMobile | |
| resetTimer() | rtabmap::Camera | |
| scanFromPointCloudData(const float *pointCloudData, int points, const Transform &pose, const CameraModel &model, const cv::Mat &rgb, std::vector< cv::KeyPoint > *kpts=0, std::vector< cv::Point3f > *kpts3D=0) | rtabmap::CameraARCore | static |
| Self() | UThreadC< void > | inlineprotectedstatic |
| Self() | UThreadC< void > | inlineprotectedstatic |
| setAffinity(int cpu=0) | UThread | |
| setData(const SensorData &data, const Transform &pose) | rtabmap::CameraMobile | |
| setGPS(const GPS &gps) | rtabmap::CameraMobile | |
| setImageRate(float imageRate) | rtabmap::Camera | inline |
| setLocalTransform(const Transform &localTransform) | rtabmap::Camera | inline |
| setPriority(Priority priority) | UThread | |
| setScreenRotationAndSize(ScreenRotation colorCameraToDisplayRotation, int width, int height) | rtabmap::CameraARCore | virtual |
| setSmoothing(bool enabled) | rtabmap::CameraMobile | inline |
| setupGL() | rtabmap::CameraARCore | |
| spinOnce() | rtabmap::CameraMobile | |
| spinOnceFrameRateTimer_ | rtabmap::CameraMobile | protected |
| spinOncePreviousStamp_ | rtabmap::CameraMobile | protected |
| start() | UThread | |
| takeImage(CameraInfo *info=0) | rtabmap::Camera | |
| TestCancel() | UThreadC< void > | inlineprotectedstatic |
| TestCancel() | UThreadC< void > | inlineprotectedstatic |
| textureId_ | rtabmap::CameraARCore | private |
| transformed_uvs_ | rtabmap::CameraARCore | private |
| UEventsSender() | UEventsSender | inline |
| updateOcclusionImage(bool enabled) | rtabmap::CameraARCore | inline |
| updateOcclusionImage_ | rtabmap::CameraARCore | private |
| UThread(Priority priority=kPNormal) | UThread | |
| UThreadC() | UThreadC< void > | inlineprotected |
| UThreadC() | UThreadC< void > | inlineprotected |
| uvs_initialized_ | rtabmap::CameraARCore | private |
| uvsInitialized() const | rtabmap::CameraARCore | inline |
| uvsTransformed() const | rtabmap::CameraARCore | inline |
| viewMatrix_ | rtabmap::CameraARCore | private |
| ~Camera() | rtabmap::Camera | virtual |
| ~CameraARCore() | rtabmap::CameraARCore | virtual |
| ~CameraMobile() | rtabmap::CameraMobile | virtual |
| ~UEventsSender() | UEventsSender | virtual |
| ~UThread() | UThread | virtual |
| ~UThreadC() | UThreadC< void > | inlinevirtual |
| ~UThreadC() | UThreadC< void > | inlinevirtual |