Public Types | Public Member Functions | Protected Member Functions | Protected Attributes | List of all members
jsk_perception::FlowVelocityThresholding Class Reference

#include <flow_velocity_thresholding.h>

Inheritance diagram for jsk_perception::FlowVelocityThresholding:
Inheritance graph
[legend]

Public Types

typedef message_filters::sync_policies::ApproximateTime< opencv_apps::FlowArrayStamped, sensor_msgs::CameraInfo > ApproximateSyncPolicy
 
typedef jsk_perception::FlowVelocityThresholdingConfig Config
 
typedef message_filters::sync_policies::ExactTime< opencv_apps::FlowArrayStamped, sensor_msgs::CameraInfo > SyncPolicy
 

Public Member Functions

 FlowVelocityThresholding ()
 
virtual ~FlowVelocityThresholding ()
 

Protected Member Functions

virtual void callback (const opencv_apps::FlowArrayStamped::ConstPtr &flows_msg)
 
virtual void callback (const opencv_apps::FlowArrayStamped::ConstPtr &flows_msg, const sensor_msgs::CameraInfo::ConstPtr &info_msg)
 
virtual void configCallback (Config &config, uint32_t level)
 
virtual void onInit ()
 
virtual void process (const opencv_apps::FlowArrayStamped::ConstPtr &flows_msg, const int image_height, const int image_width)
 
virtual void subscribe ()
 
virtual void unsubscribe ()
 

Protected Attributes

bool approximate_sync_
 
boost::shared_ptr< message_filters::Synchronizer< ApproximateSyncPolicy > > async_
 
int image_height_
 
int image_width_
 
boost::mutex mutex_
 
ros::Publisher pub_
 
int queue_size_
 
boost::shared_ptr< dynamic_reconfigure::Server< Config > > srv_
 
message_filters::Subscriber< opencv_apps::FlowArrayStamped > sub_flow_
 
message_filters::Subscriber< sensor_msgs::CameraInfo > sub_info_
 
boost::shared_ptr< message_filters::Synchronizer< SyncPolicy > > sync_
 
double threshold_
 
bool use_camera_info_
 
int window_size_
 

Detailed Description

Definition at line 83 of file flow_velocity_thresholding.h.

Member Typedef Documentation

◆ ApproximateSyncPolicy

Definition at line 123 of file flow_velocity_thresholding.h.

◆ Config

typedef jsk_perception::FlowVelocityThresholdingConfig jsk_perception::FlowVelocityThresholding::Config

Definition at line 120 of file flow_velocity_thresholding.h.

◆ SyncPolicy

typedef message_filters::sync_policies::ExactTime< opencv_apps::FlowArrayStamped, sensor_msgs::CameraInfo > jsk_perception::FlowVelocityThresholding::SyncPolicy

Definition at line 126 of file flow_velocity_thresholding.h.

Constructor & Destructor Documentation

◆ FlowVelocityThresholding()

jsk_perception::FlowVelocityThresholding::FlowVelocityThresholding ( )
inline

Definition at line 118 of file flow_velocity_thresholding.h.

◆ ~FlowVelocityThresholding()

jsk_perception::FlowVelocityThresholding::~FlowVelocityThresholding ( )
virtual

Definition at line 93 of file flow_velocity_thresholding.cpp.

Member Function Documentation

◆ callback() [1/2]

void jsk_perception::FlowVelocityThresholding::callback ( const opencv_apps::FlowArrayStamped::ConstPtr &  flows_msg)
protectedvirtual

Definition at line 154 of file flow_velocity_thresholding.cpp.

◆ callback() [2/2]

void jsk_perception::FlowVelocityThresholding::callback ( const opencv_apps::FlowArrayStamped::ConstPtr &  flows_msg,
const sensor_msgs::CameraInfo::ConstPtr &  info_msg 
)
protectedvirtual

Definition at line 160 of file flow_velocity_thresholding.cpp.

◆ configCallback()

void jsk_perception::FlowVelocityThresholding::configCallback ( Config config,
uint32_t  level 
)
protectedvirtual

Definition at line 105 of file flow_velocity_thresholding.cpp.

◆ onInit()

void jsk_perception::FlowVelocityThresholding::onInit ( )
protectedvirtual

Definition at line 79 of file flow_velocity_thresholding.cpp.

◆ process()

void jsk_perception::FlowVelocityThresholding::process ( const opencv_apps::FlowArrayStamped::ConstPtr &  flows_msg,
const int  image_height,
const int  image_width 
)
protectedvirtual

Definition at line 167 of file flow_velocity_thresholding.cpp.

◆ subscribe()

void jsk_perception::FlowVelocityThresholding::subscribe ( )
protectedvirtual

Definition at line 113 of file flow_velocity_thresholding.cpp.

◆ unsubscribe()

void jsk_perception::FlowVelocityThresholding::unsubscribe ( )
protectedvirtual

Definition at line 148 of file flow_velocity_thresholding.cpp.

Member Data Documentation

◆ approximate_sync_

bool jsk_perception::FlowVelocityThresholding::approximate_sync_
protected

Definition at line 143 of file flow_velocity_thresholding.h.

◆ async_

boost::shared_ptr<message_filters::Synchronizer<ApproximateSyncPolicy> > jsk_perception::FlowVelocityThresholding::async_
protected

Definition at line 153 of file flow_velocity_thresholding.h.

◆ image_height_

int jsk_perception::FlowVelocityThresholding::image_height_
protected

Definition at line 145 of file flow_velocity_thresholding.h.

◆ image_width_

int jsk_perception::FlowVelocityThresholding::image_width_
protected

Definition at line 146 of file flow_velocity_thresholding.h.

◆ mutex_

boost::mutex jsk_perception::FlowVelocityThresholding::mutex_
protected

Definition at line 150 of file flow_velocity_thresholding.h.

◆ pub_

ros::Publisher jsk_perception::FlowVelocityThresholding::pub_
protected

Definition at line 151 of file flow_velocity_thresholding.h.

◆ queue_size_

int jsk_perception::FlowVelocityThresholding::queue_size_
protected

Definition at line 144 of file flow_velocity_thresholding.h.

◆ srv_

boost::shared_ptr<dynamic_reconfigure::Server<Config> > jsk_perception::FlowVelocityThresholding::srv_
protected

Definition at line 156 of file flow_velocity_thresholding.h.

◆ sub_flow_

message_filters::Subscriber<opencv_apps::FlowArrayStamped> jsk_perception::FlowVelocityThresholding::sub_flow_
protected

Definition at line 154 of file flow_velocity_thresholding.h.

◆ sub_info_

message_filters::Subscriber<sensor_msgs::CameraInfo> jsk_perception::FlowVelocityThresholding::sub_info_
protected

Definition at line 155 of file flow_velocity_thresholding.h.

◆ sync_

boost::shared_ptr<message_filters::Synchronizer<SyncPolicy> > jsk_perception::FlowVelocityThresholding::sync_
protected

Definition at line 152 of file flow_velocity_thresholding.h.

◆ threshold_

double jsk_perception::FlowVelocityThresholding::threshold_
protected

Definition at line 148 of file flow_velocity_thresholding.h.

◆ use_camera_info_

bool jsk_perception::FlowVelocityThresholding::use_camera_info_
protected

Definition at line 142 of file flow_velocity_thresholding.h.

◆ window_size_

int jsk_perception::FlowVelocityThresholding::window_size_
protected

Definition at line 147 of file flow_velocity_thresholding.h.


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


jsk_perception
Author(s): Manabu Saito, Ryohei Ueda
autogenerated on Fri May 16 2025 03:11:17