Public Member Functions | Private Member Functions | Private Attributes | List of all members
rtabmap_sync::SyncDiagnostic Class Reference

#include <SyncDiagnostic.h>

Public Member Functions

void init (const std::string &topic, const std::string &topicsNotReceivedWarningMsg, std::vector< diagnostic_updater::DiagnosticTask * > otherTasks=std::vector< diagnostic_updater::DiagnosticTask * >())
 
 SyncDiagnostic (ros::NodeHandle h=ros::NodeHandle(), ros::NodeHandle ph=ros::NodeHandle("~"), std::string nodeName=ros::this_node::getName(), double tolerance=0.1, int windowSize=5)
 
void tick (const ros::Time &stamp, double targetFrequency=0)
 

Private Member Functions

void diagnosticTimerCallback (const ros::TimerEvent &event)
 

Private Attributes

diagnostic_updater::CompositeDiagnosticTask compositeTask_
 
ros::Timer diagnosticTimer_
 
diagnostic_updater::Updater diagnosticUpdater_
 
diagnostic_updater::FrequencyStatus frequencyStatus_
 
double lastCallbackCalledStamp_
 
double targetFrequency_
 
diagnostic_updater::TimeStampStatus timeStampStatus_
 
std::string topicsNotReceivedWarningMsg_
 
std::deque< double > window_
 
int windowSize_
 

Detailed Description

Definition at line 13 of file SyncDiagnostic.h.

Constructor & Destructor Documentation

◆ SyncDiagnostic()

rtabmap_sync::SyncDiagnostic::SyncDiagnostic ( ros::NodeHandle  h = ros::NodeHandle(),
ros::NodeHandle  ph = ros::NodeHandle("~"),
std::string  nodeName = ros::this_node::getName(),
double  tolerance = 0.1,
int  windowSize = 5 
)
inline

Definition at line 15 of file SyncDiagnostic.h.

Member Function Documentation

◆ diagnosticTimerCallback()

void rtabmap_sync::SyncDiagnostic::diagnosticTimerCallback ( const ros::TimerEvent event)
inlineprivate

Definition at line 85 of file SyncDiagnostic.h.

◆ init()

void rtabmap_sync::SyncDiagnostic::init ( const std::string topic,
const std::string topicsNotReceivedWarningMsg,
std::vector< diagnostic_updater::DiagnosticTask * >  otherTasks = std::vector<diagnostic_updater::DiagnosticTask*>() 
)
inline

Definition at line 27 of file SyncDiagnostic.h.

◆ tick()

void rtabmap_sync::SyncDiagnostic::tick ( const ros::Time stamp,
double  targetFrequency = 0 
)
inline

Definition at line 52 of file SyncDiagnostic.h.

Member Data Documentation

◆ compositeTask_

diagnostic_updater::CompositeDiagnosticTask rtabmap_sync::SyncDiagnostic::compositeTask_
private

Definition at line 100 of file SyncDiagnostic.h.

◆ diagnosticTimer_

ros::Timer rtabmap_sync::SyncDiagnostic::diagnosticTimer_
private

Definition at line 101 of file SyncDiagnostic.h.

◆ diagnosticUpdater_

diagnostic_updater::Updater rtabmap_sync::SyncDiagnostic::diagnosticUpdater_
private

Definition at line 97 of file SyncDiagnostic.h.

◆ frequencyStatus_

diagnostic_updater::FrequencyStatus rtabmap_sync::SyncDiagnostic::frequencyStatus_
private

Definition at line 98 of file SyncDiagnostic.h.

◆ lastCallbackCalledStamp_

double rtabmap_sync::SyncDiagnostic::lastCallbackCalledStamp_
private

Definition at line 102 of file SyncDiagnostic.h.

◆ targetFrequency_

double rtabmap_sync::SyncDiagnostic::targetFrequency_
private

Definition at line 103 of file SyncDiagnostic.h.

◆ timeStampStatus_

diagnostic_updater::TimeStampStatus rtabmap_sync::SyncDiagnostic::timeStampStatus_
private

Definition at line 99 of file SyncDiagnostic.h.

◆ topicsNotReceivedWarningMsg_

std::string rtabmap_sync::SyncDiagnostic::topicsNotReceivedWarningMsg_
private

Definition at line 96 of file SyncDiagnostic.h.

◆ window_

std::deque<double> rtabmap_sync::SyncDiagnostic::window_
private

Definition at line 105 of file SyncDiagnostic.h.

◆ windowSize_

int rtabmap_sync::SyncDiagnostic::windowSize_
private

Definition at line 104 of file SyncDiagnostic.h.


The documentation for this class was generated from the following file:


rtabmap_sync
Author(s): Mathieu Labbe
autogenerated on Mon Apr 28 2025 02:39:12