Public Member Functions | |
SyncTiming () | |
void | TearDown () |
Protected Member Functions | |
void | cbRawScanData (const urg_sim::RawScanData::Ptr data) |
void | cbSyncStart (const std_msgs::Header::ConstPtr &msg) |
void | spinFor (const ros::Duration &timeout) |
void | startSimulator (const int id, const urg_sim::URGSimulator::Params ¶ms) |
void | startUrgStamped () |
Protected Attributes | |
ros::NodeHandle | nh_ |
urg_sim::URGSimulator * | sim_ [2] |
ros::Subscriber | sub_sync_start_ |
std::map< std::string, ros::Time > | sync_start_time_ |
std::thread | th_sim_ [2] |
Definition at line 42 of file sync_timing.cpp.
|
inline |
Definition at line 45 of file sync_timing.cpp.
|
inlineprotected |
Definition at line 71 of file sync_timing.cpp.
|
inlineprotected |
Definition at line 75 of file sync_timing.cpp.
|
inlineprotected |
Definition at line 80 of file sync_timing.cpp.
|
inlineprotected |
Definition at line 92 of file sync_timing.cpp.
|
inlineprotected |
Definition at line 104 of file sync_timing.cpp.
|
inline |
Definition at line 51 of file sync_timing.cpp.
|
protected |
Definition at line 64 of file sync_timing.cpp.
|
protected |
Definition at line 67 of file sync_timing.cpp.
|
protected |
Definition at line 65 of file sync_timing.cpp.
|
protected |
Definition at line 69 of file sync_timing.cpp.
|
protected |
Definition at line 68 of file sync_timing.cpp.