#include <sync.h>
Public Member Functions | |
void | run () |
Sync (ros::NodeHandle nh, ros::NodeHandle nhp) | |
Protected Member Functions | |
void | msgsCallback (const sensor_msgs::ImageConstPtr &l_img_msg, const sensor_msgs::ImageConstPtr &r_img_msg, const sensor_msgs::CameraInfoConstPtr &l_info_msg, const sensor_msgs::CameraInfoConstPtr &r_info_msg) |
void | syncCallback (const ros::TimerEvent &) |
Private Types | |
typedef message_filters::sync_policies::ApproximateTime< sensor_msgs::Image, sensor_msgs::Image, sensor_msgs::CameraInfo, sensor_msgs::CameraInfo > | SyncPolicy |
More... | |
typedef message_filters::Synchronizer< SyncPolicy > | SyncType |
Private Attributes | |
string | camera_ |
More... | |
bool | init_ |
image_transport::ImageTransport | it_ |
double | last_ros_sync_ |
More... | |
double | max_unsync_time_ |
More... | |
ros::NodeHandle | nh_ |
ros::NodeHandle | nhp_ |
ros::Publisher | pub_info_ |
ros::Timer | sync_timer_ |
More... | |
double | timer_period_ |
More... | |
|
private |
|
private |
avt_vimba_camera::Sync::Sync | ( | ros::NodeHandle | nh, |
ros::NodeHandle | nhp | ||
) |
|
protected |
|
protected |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |