Public Types | Public Member Functions | Protected Member Functions | Protected Attributes | List of all members
jsk_pcl_ros::HeightmapToPointCloud Class Reference

#include <heightmap_to_pointcloud.h>

Inheritance diagram for jsk_pcl_ros::HeightmapToPointCloud:
Inheritance graph
[legend]

Public Types

typedef boost::shared_ptr< HeightmapToPointCloudPtr
 

Public Member Functions

 HeightmapToPointCloud ()
 

Protected Member Functions

virtual void configCallback (const jsk_recognition_msgs::HeightmapConfig::ConstPtr &msg)
 
virtual void convert (const sensor_msgs::Image::ConstPtr &msg)
 
virtual void onInit ()
 
virtual void subscribe ()
 
virtual void unsubscribe ()
 

Protected Attributes

jsk_recognition_msgs::HeightmapConfig::ConstPtr config_msg_
 
double max_x_
 
double max_y_
 
double min_x_
 
double min_y_
 
boost::mutex mutex_
 
ros::Publisher pub_
 
ros::Publisher pub_config_
 
ros::Subscriber sub_
 
ros::Subscriber sub_config_
 

Detailed Description

Definition at line 81 of file heightmap_to_pointcloud.h.

Member Typedef Documentation

◆ Ptr

Definition at line 116 of file heightmap_to_pointcloud.h.

Constructor & Destructor Documentation

◆ HeightmapToPointCloud()

jsk_pcl_ros::HeightmapToPointCloud::HeightmapToPointCloud ( )
inline

Definition at line 117 of file heightmap_to_pointcloud.h.

Member Function Documentation

◆ configCallback()

void jsk_pcl_ros::HeightmapToPointCloud::configCallback ( const jsk_recognition_msgs::HeightmapConfig::ConstPtr &  msg)
protectedvirtual

Definition at line 69 of file heightmap_to_pointcloud_nodelet.cpp.

◆ convert()

void jsk_pcl_ros::HeightmapToPointCloud::convert ( const sensor_msgs::Image::ConstPtr &  msg)
protectedvirtual

Definition at line 81 of file heightmap_to_pointcloud_nodelet.cpp.

◆ onInit()

void jsk_pcl_ros::HeightmapToPointCloud::onInit ( )
protectedvirtual

Definition at line 47 of file heightmap_to_pointcloud_nodelet.cpp.

◆ subscribe()

void jsk_pcl_ros::HeightmapToPointCloud::subscribe ( )
protectedvirtual

Definition at line 59 of file heightmap_to_pointcloud_nodelet.cpp.

◆ unsubscribe()

void jsk_pcl_ros::HeightmapToPointCloud::unsubscribe ( )
protectedvirtual

Definition at line 64 of file heightmap_to_pointcloud_nodelet.cpp.

Member Data Documentation

◆ config_msg_

jsk_recognition_msgs::HeightmapConfig::ConstPtr jsk_pcl_ros::HeightmapToPointCloud::config_msg_
protected

Definition at line 126 of file heightmap_to_pointcloud.h.

◆ max_x_

double jsk_pcl_ros::HeightmapToPointCloud::max_x_
protected

Definition at line 133 of file heightmap_to_pointcloud.h.

◆ max_y_

double jsk_pcl_ros::HeightmapToPointCloud::max_y_
protected

Definition at line 135 of file heightmap_to_pointcloud.h.

◆ min_x_

double jsk_pcl_ros::HeightmapToPointCloud::min_x_
protected

Definition at line 132 of file heightmap_to_pointcloud.h.

◆ min_y_

double jsk_pcl_ros::HeightmapToPointCloud::min_y_
protected

Definition at line 134 of file heightmap_to_pointcloud.h.

◆ mutex_

boost::mutex jsk_pcl_ros::HeightmapToPointCloud::mutex_
protected

Definition at line 127 of file heightmap_to_pointcloud.h.

◆ pub_

ros::Publisher jsk_pcl_ros::HeightmapToPointCloud::pub_
protected

Definition at line 128 of file heightmap_to_pointcloud.h.

◆ pub_config_

ros::Publisher jsk_pcl_ros::HeightmapToPointCloud::pub_config_
protected

Definition at line 129 of file heightmap_to_pointcloud.h.

◆ sub_

ros::Subscriber jsk_pcl_ros::HeightmapToPointCloud::sub_
protected

Definition at line 130 of file heightmap_to_pointcloud.h.

◆ sub_config_

ros::Subscriber jsk_pcl_ros::HeightmapToPointCloud::sub_config_
protected

Definition at line 131 of file heightmap_to_pointcloud.h.


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


jsk_pcl_ros
Author(s): Yohei Kakiuchi
autogenerated on Tue Jan 7 2025 04:05:46