This is the complete list of members for rtabmap::DBDriver, including all inherited members.
| _addSem | rtabmap::DBDriver | private |
| _dbSafeAccessMutex | rtabmap::DBDriver | private |
| _emptyTrashesTime | rtabmap::DBDriver | private |
| _targetVersion | rtabmap::DBDriver | private |
| _timestampUpdate | rtabmap::DBDriver | private |
| _transactionMutex | rtabmap::DBDriver | private |
| _trashesMutex | rtabmap::DBDriver | private |
| _trashSignatures | rtabmap::DBDriver | private |
| _trashVisualWords | rtabmap::DBDriver | private |
| _url | rtabmap::DBDriver | private |
| addInfoAfterRun(int stMemSize, int lastSignAdded, int processMemUsed, int databaseMemUsed, int dictionarySize, const ParametersMap ¶meters) const | rtabmap::DBDriver | |
| addLink(const Link &link) | rtabmap::DBDriver | |
| addLinkQuery(const Link &link) const =0 | rtabmap::DBDriver | protectedpure virtual |
| addStatistics(const Statistics &statistics, bool saveWmState) const | rtabmap::DBDriver | |
| addStatisticsQuery(const Statistics &statistics, bool saveWmState) const =0 | rtabmap::DBDriver | protectedpure virtual |
| asyncSave(Signature *s) | rtabmap::DBDriver | |
| asyncSave(VisualWord *vw) | rtabmap::DBDriver | |
| beginTransaction() const | rtabmap::DBDriver | |
| closeConnection(bool save=true, const std::string &outputUrl="") | rtabmap::DBDriver | |
| commit() const | rtabmap::DBDriver | |
| connectDatabaseQuery(const std::string &url, bool overwritten=false)=0 | rtabmap::DBDriver | protectedpure virtual |
| create(const ParametersMap ¶meters=ParametersMap()) | rtabmap::DBDriver | static |
| 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 |
| DBDriver(const ParametersMap ¶meters=ParametersMap()) | rtabmap::DBDriver | protected |
| UThreadC< void >::Detach(const Handle &H) | UThreadC< void > | inlinestatic |
| disconnectDatabaseQuery(bool save=true, const std::string &outputUrl="")=0 | rtabmap::DBDriver | protectedpure virtual |
| emptyTrashes(bool async=false) | rtabmap::DBDriver | |
| executeNoResult(const std::string &sql) const | rtabmap::DBDriver | |
| executeNoResultQuery(const std::string &sql) const =0 | rtabmap::DBDriver | protectedpure virtual |
| Exit() | UThreadC< void > | inlineprotectedstatic |
| Exit() | UThreadC< void > | inlineprotectedstatic |
| generateGraph(const std::string &fileName, const std::set< int > &ids=std::set< int >(), const std::map< int, Signature * > &otherSignatures=std::map< int, Signature * >()) | rtabmap::DBDriver | |
| getAllLabels(std::map< int, std::string > &labels) const | rtabmap::DBDriver | |
| getAllLabelsQuery(std::map< int, std::string > &labels) const =0 | rtabmap::DBDriver | protectedpure virtual |
| getAllLinks(std::multimap< int, Link > &links, bool ignoreNullLinks=true, bool withLandmarks=false) const | rtabmap::DBDriver | |
| getAllLinksQuery(std::multimap< int, Link > &links, bool ignoreNullLinks, bool withLandmarks) const =0 | rtabmap::DBDriver | protectedpure virtual |
| getAllNodeIds(std::set< int > &ids, bool ignoreChildren=false, bool ignoreBadSignatures=false) const | rtabmap::DBDriver | |
| getAllNodeIdsQuery(std::set< int > &ids, bool ignoreChildren, bool ignoreBadSignatures) const =0 | rtabmap::DBDriver | protectedpure virtual |
| getAllStatistics() const | rtabmap::DBDriver | |
| getAllStatisticsQuery() const =0 | rtabmap::DBDriver | protectedpure virtual |
| getAllStatisticsWmStates() const | rtabmap::DBDriver | |
| getAllStatisticsWmStatesQuery() const =0 | rtabmap::DBDriver | protectedpure virtual |
| getCalibration(int signatureId, std::vector< CameraModel > &models, StereoCameraModel &stereoModel) const | rtabmap::DBDriver | |
| getCalibrationQuery(int signatureId, std::vector< CameraModel > &models, StereoCameraModel &stereoModel) const =0 | rtabmap::DBDriver | protectedpure virtual |
| getCalibrationsMemoryUsed() const | rtabmap::DBDriver | |
| getCalibrationsMemoryUsedQuery() const =0 | rtabmap::DBDriver | protectedpure virtual |
| getDatabaseVersion() const | rtabmap::DBDriver | |
| getDatabaseVersionQuery(std::string &version) const =0 | rtabmap::DBDriver | protectedpure virtual |
| getDepthImagesMemoryUsed() const | rtabmap::DBDriver | |
| getDepthImagesMemoryUsedQuery() const =0 | rtabmap::DBDriver | protectedpure virtual |
| getEmptyTrashesTime() const | rtabmap::DBDriver | inline |
| getFeaturesMemoryUsed() const | rtabmap::DBDriver | |
| getFeaturesMemoryUsedQuery() const =0 | rtabmap::DBDriver | protectedpure virtual |
| getGridsMemoryUsed() const | rtabmap::DBDriver | |
| getGridsMemoryUsedQuery() const =0 | rtabmap::DBDriver | protectedpure virtual |
| getImagesMemoryUsed() const | rtabmap::DBDriver | |
| getImagesMemoryUsedQuery() const =0 | rtabmap::DBDriver | protectedpure virtual |
| getInvertedIndexNi(int signatureId, int &ni) const | rtabmap::DBDriver | |
| getInvertedIndexNiQuery(int signatureId, int &ni) const =0 | rtabmap::DBDriver | protectedpure virtual |
| getLaserScanInfo(int signatureId, LaserScan &info) const | rtabmap::DBDriver | |
| getLaserScanInfoQuery(int signatureId, LaserScan &info) const =0 | rtabmap::DBDriver | protectedpure virtual |
| getLaserScansMemoryUsed() const | rtabmap::DBDriver | |
| getLaserScansMemoryUsedQuery() const =0 | rtabmap::DBDriver | protectedpure virtual |
| getLastDictionarySize() const | rtabmap::DBDriver | |
| getLastDictionarySizeQuery() const =0 | rtabmap::DBDriver | protectedpure virtual |
| getLastIdQuery(const std::string &tableName, int &id, const std::string &fieldName="id") const =0 | rtabmap::DBDriver | protectedpure virtual |
| getLastMapId(int &mapId) const | rtabmap::DBDriver | |
| getLastNodeId(int &id) const | rtabmap::DBDriver | |
| getLastNodeIds(std::set< int > &ids) const | rtabmap::DBDriver | |
| getLastNodeIdsQuery(std::set< int > &ids) const =0 | rtabmap::DBDriver | protectedpure virtual |
| getLastNodesSize() const | rtabmap::DBDriver | |
| getLastNodesSizeQuery() const =0 | rtabmap::DBDriver | protectedpure virtual |
| getLastParameters() const | rtabmap::DBDriver | |
| getLastParametersQuery() const =0 | rtabmap::DBDriver | protectedpure virtual |
| getLastWordId(int &id) const | rtabmap::DBDriver | |
| getLinksMemoryUsed() const | rtabmap::DBDriver | |
| getLinksMemoryUsedQuery() const =0 | rtabmap::DBDriver | protectedpure virtual |
| getMemoryUsed() const | rtabmap::DBDriver | |
| getMemoryUsedQuery() const =0 | rtabmap::DBDriver | protectedpure virtual |
| getNodeData(int signatureId, SensorData &data, bool images=true, bool scan=true, bool userData=true, bool occupancyGrid=true) const | rtabmap::DBDriver | |
| getNodeIdByLabel(const std::string &label, int &id) const | rtabmap::DBDriver | |
| getNodeIdByLabelQuery(const std::string &label, int &id) const =0 | rtabmap::DBDriver | protectedpure virtual |
| getNodeInfo(int signatureId, Transform &pose, int &mapId, int &weight, std::string &label, double &stamp, Transform &groundTruthPose, std::vector< float > &velocity, GPS &gps, EnvSensors &sensors) const | rtabmap::DBDriver | |
| getNodeInfoQuery(int signatureId, Transform &pose, int &mapId, int &weight, std::string &label, double &stamp, Transform &groundTruthPose, std::vector< float > &velocity, GPS &gps, EnvSensors &sensors) const =0 | rtabmap::DBDriver | protectedpure virtual |
| getNodesMemoryUsed() const | rtabmap::DBDriver | |
| getNodesMemoryUsedQuery() const =0 | rtabmap::DBDriver | protectedpure virtual |
| getNodesObservingLandmark(int landmarkId, std::map< int, Link > &nodes) const | rtabmap::DBDriver | |
| getNodesObservingLandmarkQuery(int landmarkId, std::map< int, Link > &nodes) const =0 | rtabmap::DBDriver | protectedpure virtual |
| getStatistics(int nodeId, double &stamp, std::vector< int > *wmState=0) const | rtabmap::DBDriver | |
| getStatisticsMemoryUsed() const | rtabmap::DBDriver | |
| getStatisticsMemoryUsedQuery() const =0 | rtabmap::DBDriver | protectedpure virtual |
| getStatisticsQuery(int nodeId, double &stamp, std::vector< int > *wmState) const =0 | rtabmap::DBDriver | protectedpure virtual |
| getTargetVersion() const | rtabmap::DBDriver | inline |
| getThreadHandle() const | UThread | inline |
| getThreadId() const | UThread | inline |
| getTotalDictionarySize() const | rtabmap::DBDriver | |
| getTotalDictionarySizeQuery() const =0 | rtabmap::DBDriver | protectedpure virtual |
| getTotalNodesSize() const | rtabmap::DBDriver | |
| getTotalNodesSizeQuery() const =0 | rtabmap::DBDriver | protectedpure virtual |
| getUrl() const | rtabmap::DBDriver | inline |
| getUserDataMemoryUsed() const | rtabmap::DBDriver | |
| getUserDataMemoryUsedQuery() const =0 | rtabmap::DBDriver | protectedpure virtual |
| getWeight(int signatureId, int &weight) const | rtabmap::DBDriver | |
| getWeightQuery(int signatureId, int &weight) const =0 | rtabmap::DBDriver | protectedpure virtual |
| getWordsMemoryUsed() const | rtabmap::DBDriver | |
| getWordsMemoryUsedQuery() const =0 | rtabmap::DBDriver | protectedpure virtual |
| Handle typedef | UThreadC< void > | |
| Handle typedef | UThreadC< void > | |
| Handler typedef | UThreadC< void > | |
| Handler typedef | UThreadC< void > | |
| isConnected() const | rtabmap::DBDriver | |
| isConnectedQuery() const =0 | rtabmap::DBDriver | protectedpure virtual |
| isCreating() const | UThread | |
| isIdle() const | UThread | |
| isInMemory() const | rtabmap::DBDriver | inlinevirtual |
| isKilled() const | UThread | |
| isRunning() const | UThread | |
| UThreadC< void >::Join(const Handle &H) | UThreadC< void > | inlinestatic |
| join(bool killFirst=false) | UThread | |
| kill() | UThread | |
| UThreadC< void >::Kill(const Handle &H) | UThreadC< void > | inlinestatic |
| kPAboveNormal enum value | UThread | |
| kPBelowNormal enum value | UThread | |
| kPLow enum value | UThread | |
| kPNormal enum value | UThread | |
| kPRealTime enum value | UThread | |
| load(VWDictionary *dictionary, bool lastStateOnly=true) const | rtabmap::DBDriver | |
| load2DMap(float &xMin, float &yMin, float &cellSize) const | rtabmap::DBDriver | |
| load2DMapQuery(float &xMin, float &yMin, float &cellSize) const =0 | rtabmap::DBDriver | protectedpure virtual |
| loadLastNodes(std::list< Signature * > &signatures) const | rtabmap::DBDriver | |
| loadLastNodesQuery(std::list< Signature * > &signatures) const =0 | rtabmap::DBDriver | protectedpure virtual |
| loadLinks(int signatureId, std::multimap< int, Link > &links, Link::Type type=Link::kUndef) const | rtabmap::DBDriver | |
| loadLinksQuery(int signatureId, std::multimap< int, Link > &links, Link::Type type=Link::kUndef) const =0 | rtabmap::DBDriver | protectedpure virtual |
| loadNodeData(Signature *signature, bool images=true, bool scan=true, bool userData=true, bool occupancyGrid=true) const | rtabmap::DBDriver | |
| loadNodeData(std::list< Signature * > &signatures, bool images=true, bool scan=true, bool userData=true, bool occupancyGrid=true) const | rtabmap::DBDriver | |
| loadNodeDataQuery(std::list< Signature * > &signatures, bool images=true, bool scan=true, bool userData=true, bool occupancyGrid=true) const =0 | rtabmap::DBDriver | protectedpure virtual |
| loadOptimizedMesh(std::vector< std::vector< std::vector< RTABMAP_PCL_INDEX > > > *polygons=0, std::vector< std::vector< Eigen::Vector2f > > *texCoords=0, cv::Mat *textures=0) const | rtabmap::DBDriver | |
| loadOptimizedMeshQuery(std::vector< std::vector< std::vector< RTABMAP_PCL_INDEX > > > *polygons, std::vector< std::vector< Eigen::Vector2f > > *texCoords, cv::Mat *textures) const =0 | rtabmap::DBDriver | protectedpure virtual |
| loadOptimizedPoses(Transform *lastlocalizationPose=0) const | rtabmap::DBDriver | |
| loadOptimizedPosesQuery(Transform *lastlocalizationPose=0) const =0 | rtabmap::DBDriver | protectedpure virtual |
| loadPreviewImage() const | rtabmap::DBDriver | |
| loadPreviewImageQuery() const =0 | rtabmap::DBDriver | protectedpure virtual |
| loadQuery(VWDictionary *dictionary, bool lastStateOnly=true) const =0 | rtabmap::DBDriver | protectedpure virtual |
| loadSignature(int id, bool *loadedFromTrash=0) | rtabmap::DBDriver | |
| loadSignatures(const std::list< int > &ids, std::list< Signature * > &signatures, std::set< int > *loadedFromTrash=0) | rtabmap::DBDriver | |
| loadSignaturesQuery(const std::list< int > &ids, std::list< Signature * > &signatures) const =0 | rtabmap::DBDriver | protectedpure virtual |
| loadWords(const std::set< int > &wordIds, std::list< VisualWord * > &vws) | rtabmap::DBDriver | |
| loadWordsQuery(const std::set< int > &wordIds, std::list< VisualWord * > &vws) const =0 | rtabmap::DBDriver | protectedpure virtual |
| mainLoop() | rtabmap::DBDriver | privatevirtual |
| openConnection(const std::string &url, bool overwritten=false) | rtabmap::DBDriver | |
| parseParameters(const ParametersMap ¶meters) | rtabmap::DBDriver | virtual |
| Priority enum name | UThread | |
| removeLink(int from, int to) | rtabmap::DBDriver | |
| save2DMap(const cv::Mat &map, float xMin, float yMin, float cellSize) const | rtabmap::DBDriver | |
| save2DMapQuery(const cv::Mat &map, float xMin, float yMin, float cellSize) const =0 | rtabmap::DBDriver | protectedpure virtual |
| saveOptimizedMesh(const cv::Mat &cloud, const std::vector< std::vector< std::vector< RTABMAP_PCL_INDEX > > > &polygons=std::vector< std::vector< std::vector< RTABMAP_PCL_INDEX > > >(), const std::vector< std::vector< Eigen::Vector2f > > &texCoords=std::vector< std::vector< Eigen::Vector2f > >(), const cv::Mat &textures=cv::Mat()) const | rtabmap::DBDriver | |
| saveOptimizedMeshQuery(const cv::Mat &cloud, const std::vector< std::vector< std::vector< RTABMAP_PCL_INDEX > > > &polygons, const std::vector< std::vector< Eigen::Vector2f > > &texCoords, const cv::Mat &textures) const =0 | rtabmap::DBDriver | protectedpure virtual |
| saveOptimizedPoses(const std::map< int, Transform > &optimizedPoses, const Transform &lastlocalizationPose) const | rtabmap::DBDriver | |
| saveOptimizedPosesQuery(const std::map< int, Transform > &optimizedPoses, const Transform &lastlocalizationPose) const =0 | rtabmap::DBDriver | protectedpure virtual |
| saveOrUpdate(const std::vector< Signature * > &signatures) | rtabmap::DBDriver | private |
| saveOrUpdate(const std::vector< VisualWord * > &words) const | rtabmap::DBDriver | private |
| savePreviewImage(const cv::Mat &image) const | rtabmap::DBDriver | |
| savePreviewImageQuery(const cv::Mat &image) const =0 | rtabmap::DBDriver | protectedpure virtual |
| saveQuery(const std::list< Signature * > &signatures)=0 | rtabmap::DBDriver | protectedpure virtual |
| saveQuery(const std::list< VisualWord * > &words) const =0 | rtabmap::DBDriver | protectedpure virtual |
| Self() | UThreadC< void > | inlineprotectedstatic |
| Self() | UThreadC< void > | inlineprotectedstatic |
| setAffinity(int cpu=0) | UThread | |
| setPriority(Priority priority) | UThread | |
| setTimestampUpdateEnabled(bool enabled) | rtabmap::DBDriver | inline |
| start() | UThread | |
| TestCancel() | UThreadC< void > | inlineprotectedstatic |
| TestCancel() | UThreadC< void > | inlineprotectedstatic |
| updateDepthImage(int nodeId, const cv::Mat &image) | rtabmap::DBDriver | |
| updateDepthImageQuery(int nodeId, const cv::Mat &image) const =0 | rtabmap::DBDriver | protectedpure virtual |
| updateLaserScan(int nodeId, const LaserScan &scan) | rtabmap::DBDriver | |
| updateLaserScanQuery(int nodeId, const LaserScan &scan) const =0 | rtabmap::DBDriver | protectedpure virtual |
| updateLink(const Link &link) | rtabmap::DBDriver | |
| updateLinkQuery(const Link &link) const =0 | rtabmap::DBDriver | protectedpure virtual |
| updateOccupancyGrid(int nodeId, const cv::Mat &ground, const cv::Mat &obstacles, const cv::Mat &empty, float cellSize, const cv::Point3f &viewpoint) | rtabmap::DBDriver | |
| updateOccupancyGridQuery(int nodeId, const cv::Mat &ground, const cv::Mat &obstacles, const cv::Mat &empty, float cellSize, const cv::Point3f &viewpoint) const =0 | rtabmap::DBDriver | protectedpure virtual |
| updateQuery(const std::list< Signature * > &signatures, bool updateTimestamp) const =0 | rtabmap::DBDriver | protectedpure virtual |
| updateQuery(const std::list< VisualWord * > &words, bool updateTimestamp) const =0 | rtabmap::DBDriver | protectedpure virtual |
| UThread(Priority priority=kPNormal) | UThread | |
| UThreadC() | UThreadC< void > | inlineprotected |
| UThreadC() | UThreadC< void > | inlineprotected |
| ~DBDriver() | rtabmap::DBDriver | virtual |
| ~UThread() | UThread | virtual |
| ~UThreadC() | UThreadC< void > | inlinevirtual |
| ~UThreadC() | UThreadC< void > | inlinevirtual |