Public Member Functions | Protected Member Functions | Private Types | Private Attributes
avt_vimba_camera::Sync Class Reference

#include <sync.h>

List of all members.

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
 > Camera name
typedef
message_filters::Synchronizer
< SyncPolicy
SyncType

Private Attributes

string camera_
 > Timer to check the image sync
bool init_
image_transport::ImageTransport it_
double last_ros_sync_
 > True when node is initialized.
double max_unsync_time_
 > Timer period
ros::NodeHandle nh_
ros::NodeHandle nhp_
ros::Publisher pub_info_
ros::Timer sync_timer_
 > Maximum time without sync
double timer_period_
 > Last ros time sync

Detailed Description

Definition at line 48 of file sync.h.


Member Typedef Documentation

typedef message_filters::sync_policies::ApproximateTime<sensor_msgs::Image, sensor_msgs::Image, sensor_msgs::CameraInfo, sensor_msgs::CameraInfo> avt_vimba_camera::Sync::SyncPolicy [private]

> Camera name

Definition at line 80 of file sync.h.

Definition at line 81 of file sync.h.


Constructor & Destructor Documentation

Definition at line 38 of file sync.cpp.


Member Function Documentation

void avt_vimba_camera::Sync::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 
) [protected]

Definition at line 70 of file sync.cpp.

Definition at line 46 of file sync.cpp.

void avt_vimba_camera::Sync::syncCallback ( const ros::TimerEvent ) [protected]

Definition at line 82 of file sync.cpp.


Member Data Documentation

> Timer to check the image sync

Definition at line 74 of file sync.h.

Definition at line 69 of file sync.h.

Definition at line 84 of file sync.h.

> True when node is initialized.

Definition at line 70 of file sync.h.

> Timer period

Definition at line 72 of file sync.h.

Definition at line 66 of file sync.h.

Definition at line 67 of file sync.h.

Definition at line 86 of file sync.h.

> Maximum time without sync

Definition at line 73 of file sync.h.

> Last ros time sync

Definition at line 71 of file sync.h.


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


avt_vimba_camera
Author(s): Miquel Massot , Allied Vision Technologies
autogenerated on Thu Jun 6 2019 18:23:39