Private Types | Private Member Functions | Private Attributes | List of all members
depth_image_proc::PointCloudXyziRadialNodelet Class Reference
Inheritance diagram for depth_image_proc::PointCloudXyziRadialNodelet:
Inheritance graph
[legend]

Private Types

typedef sensor_msgs::PointCloud2 PointCloud
 
typedef message_filters::Synchronizer< SyncPolicySynchronizer
 

Private Member Functions

void connectCb ()
 
template<typename T >
void convert_depth (const sensor_msgs::ImageConstPtr &depth_msg, PointCloud::Ptr &cloud_msg)
 
template<typename T >
void convert_intensity (const sensor_msgs::ImageConstPtr &inten_msg, PointCloud::Ptr &cloud_msg)
 
void imageCb (const sensor_msgs::ImageConstPtr &depth_msg, const sensor_msgs::ImageConstPtr &intensity_msg_in, const sensor_msgs::CameraInfoConstPtr &info_msg)
 
cv::Mat initMatrix (cv::Mat cameraMatrix, cv::Mat distCoeffs, int width, int height, bool radial)
 
virtual void onInit ()
 

Private Attributes

boost::mutex connect_mutex_
 
std::vector< double > D_
 
boost::shared_ptr< image_transport::ImageTransportdepth_it_
 
int height_
 
boost::shared_ptr< image_transport::ImageTransportintensity_it_
 
ros::NodeHandlePtr intensity_nh_
 
boost::array< double, 9 > K_
 
ros::Publisher pub_point_cloud_
 
int queue_size_
 
image_transport::SubscriberFilter sub_depth_
 
message_filters::Subscriber< sensor_msgs::CameraInfo > sub_info_
 
image_transport::SubscriberFilter sub_intensity_
 
boost::shared_ptr< Synchronizersync_
 
cv::Mat transform_
 
int width_
 

Additional Inherited Members

- Public Member Functions inherited from nodelet::Nodelet
void init (const std::string &name, const M_string &remapping_args, const V_string &my_argv, ros::CallbackQueueInterface *st_queue=NULL, ros::CallbackQueueInterface *mt_queue=NULL)
 
 Nodelet ()
 
virtual ~Nodelet ()
 
- Protected Member Functions inherited from nodelet::Nodelet
ros::CallbackQueueInterfacegetMTCallbackQueue () const
 
ros::NodeHandlegetMTNodeHandle () const
 
ros::NodeHandlegetMTPrivateNodeHandle () const
 
const V_stringgetMyArgv () const
 
const std::string & getName () const
 
ros::NodeHandlegetNodeHandle () const
 
ros::NodeHandlegetPrivateNodeHandle () const
 
const M_stringgetRemappingArgs () const
 
ros::CallbackQueueInterfacegetSTCallbackQueue () const
 
std::string getSuffixedName (const std::string &suffix) const
 

Detailed Description

Definition at line 87 of file point_cloud_xyzi_radial.cpp.

Member Typedef Documentation

◆ PointCloud

typedef sensor_msgs::PointCloud2 depth_image_proc::PointCloudXyziRadialNodelet::PointCloud
private

Definition at line 100 of file point_cloud_xyzi_radial.cpp.

◆ Synchronizer

Definition at line 104 of file point_cloud_xyzi_radial.cpp.

Member Function Documentation

◆ connectCb()

void depth_image_proc::PointCloudXyziRadialNodelet::connectCb ( )
private

Definition at line 202 of file point_cloud_xyzi_radial.cpp.

◆ convert_depth()

template<typename T >
void depth_image_proc::PointCloudXyziRadialNodelet::convert_depth ( const sensor_msgs::ImageConstPtr &  depth_msg,
PointCloud::Ptr &  cloud_msg 
)
private

Definition at line 295 of file point_cloud_xyzi_radial.cpp.

◆ convert_intensity()

template<typename T >
void depth_image_proc::PointCloudXyziRadialNodelet::convert_intensity ( const sensor_msgs::ImageConstPtr &  inten_msg,
PointCloud::Ptr &  cloud_msg 
)
private

Definition at line 330 of file point_cloud_xyzi_radial.cpp.

◆ imageCb()

void depth_image_proc::PointCloudXyziRadialNodelet::imageCb ( const sensor_msgs::ImageConstPtr &  depth_msg,
const sensor_msgs::ImageConstPtr &  intensity_msg_in,
const sensor_msgs::CameraInfoConstPtr &  info_msg 
)
private

Definition at line 229 of file point_cloud_xyzi_radial.cpp.

◆ initMatrix()

cv::Mat depth_image_proc::PointCloudXyziRadialNodelet::initMatrix ( cv::Mat  cameraMatrix,
cv::Mat  distCoeffs,
int  width,
int  height,
bool  radial 
)
private

Definition at line 134 of file point_cloud_xyzi_radial.cpp.

◆ onInit()

void depth_image_proc::PointCloudXyziRadialNodelet::onInit ( )
privatevirtual

Implements nodelet::Nodelet.

Definition at line 176 of file point_cloud_xyzi_radial.cpp.

Member Data Documentation

◆ connect_mutex_

boost::mutex depth_image_proc::PointCloudXyziRadialNodelet::connect_mutex_
private

Definition at line 99 of file point_cloud_xyzi_radial.cpp.

◆ D_

std::vector<double> depth_image_proc::PointCloudXyziRadialNodelet::D_
private

Definition at line 107 of file point_cloud_xyzi_radial.cpp.

◆ depth_it_

boost::shared_ptr<image_transport::ImageTransport> depth_image_proc::PointCloudXyziRadialNodelet::depth_it_
private

Definition at line 92 of file point_cloud_xyzi_radial.cpp.

◆ height_

int depth_image_proc::PointCloudXyziRadialNodelet::height_
private

Definition at line 111 of file point_cloud_xyzi_radial.cpp.

◆ intensity_it_

boost::shared_ptr<image_transport::ImageTransport> depth_image_proc::PointCloudXyziRadialNodelet::intensity_it_
private

Definition at line 92 of file point_cloud_xyzi_radial.cpp.

◆ intensity_nh_

ros::NodeHandlePtr depth_image_proc::PointCloudXyziRadialNodelet::intensity_nh_
private

Definition at line 89 of file point_cloud_xyzi_radial.cpp.

◆ K_

boost::array<double, 9> depth_image_proc::PointCloudXyziRadialNodelet::K_
private

Definition at line 108 of file point_cloud_xyzi_radial.cpp.

◆ pub_point_cloud_

ros::Publisher depth_image_proc::PointCloudXyziRadialNodelet::pub_point_cloud_
private

Definition at line 101 of file point_cloud_xyzi_radial.cpp.

◆ queue_size_

int depth_image_proc::PointCloudXyziRadialNodelet::queue_size_
private

Definition at line 96 of file point_cloud_xyzi_radial.cpp.

◆ sub_depth_

image_transport::SubscriberFilter depth_image_proc::PointCloudXyziRadialNodelet::sub_depth_
private

Definition at line 93 of file point_cloud_xyzi_radial.cpp.

◆ sub_info_

message_filters::Subscriber<sensor_msgs::CameraInfo> depth_image_proc::PointCloudXyziRadialNodelet::sub_info_
private

Definition at line 94 of file point_cloud_xyzi_radial.cpp.

◆ sub_intensity_

image_transport::SubscriberFilter depth_image_proc::PointCloudXyziRadialNodelet::sub_intensity_
private

Definition at line 93 of file point_cloud_xyzi_radial.cpp.

◆ sync_

boost::shared_ptr<Synchronizer> depth_image_proc::PointCloudXyziRadialNodelet::sync_
private

Definition at line 105 of file point_cloud_xyzi_radial.cpp.

◆ transform_

cv::Mat depth_image_proc::PointCloudXyziRadialNodelet::transform_
private

Definition at line 113 of file point_cloud_xyzi_radial.cpp.

◆ width_

int depth_image_proc::PointCloudXyziRadialNodelet::width_
private

Definition at line 110 of file point_cloud_xyzi_radial.cpp.


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


depth_image_proc
Author(s): Patrick Mihelich
autogenerated on Wed Jan 24 2024 03:57:15