#include <heightmap_converter.h>
Definition at line 86 of file heightmap_converter.h.
◆ Config
◆ Ptr
◆ HeightmapConverter()
jsk_pcl_ros::HeightmapConverter::HeightmapConverter |
( |
| ) |
|
|
inline |
◆ configCallback()
void jsk_pcl_ros::HeightmapConverter::configCallback |
( |
Config & |
config, |
|
|
uint32_t |
level |
|
) |
| |
|
protectedvirtual |
◆ convert()
void jsk_pcl_ros::HeightmapConverter::convert |
( |
const sensor_msgs::PointCloud2::ConstPtr & |
msg | ) |
|
|
protectedvirtual |
◆ onInit()
void jsk_pcl_ros::HeightmapConverter::onInit |
( |
| ) |
|
|
protectedvirtual |
◆ subscribe()
void jsk_pcl_ros::HeightmapConverter::subscribe |
( |
| ) |
|
|
protectedvirtual |
◆ toIndex()
cv::Point jsk_pcl_ros::HeightmapConverter::toIndex |
( |
const pcl::PointXYZ & |
p | ) |
const |
|
inlineprotected |
◆ unsubscribe()
void jsk_pcl_ros::HeightmapConverter::unsubscribe |
( |
| ) |
|
|
protectedvirtual |
◆ center_frame_id_
std::string jsk_pcl_ros::HeightmapConverter::center_frame_id_ |
|
protected |
◆ duration_transform_timeout_
double jsk_pcl_ros::HeightmapConverter::duration_transform_timeout_ |
|
protected |
◆ fixed_frame_id_
std::string jsk_pcl_ros::HeightmapConverter::fixed_frame_id_ |
|
protected |
◆ initial_probability_
double jsk_pcl_ros::HeightmapConverter::initial_probability_ |
|
protected |
◆ max_queue_size_
int jsk_pcl_ros::HeightmapConverter::max_queue_size_ |
|
protected |
◆ max_x_
double jsk_pcl_ros::HeightmapConverter::max_x_ |
|
protected |
◆ max_y_
double jsk_pcl_ros::HeightmapConverter::max_y_ |
|
protected |
◆ max_z_
double jsk_pcl_ros::HeightmapConverter::max_z_ |
|
protected |
◆ min_x_
double jsk_pcl_ros::HeightmapConverter::min_x_ |
|
protected |
◆ min_y_
double jsk_pcl_ros::HeightmapConverter::min_y_ |
|
protected |
◆ min_z_
double jsk_pcl_ros::HeightmapConverter::min_z_ |
|
protected |
◆ mutex_
◆ projected_center_frame_id_
std::string jsk_pcl_ros::HeightmapConverter::projected_center_frame_id_ |
|
protected |
◆ pub_
◆ pub_config_
◆ resolution_x_
int jsk_pcl_ros::HeightmapConverter::resolution_x_ |
|
protected |
◆ resolution_y_
int jsk_pcl_ros::HeightmapConverter::resolution_y_ |
|
protected |
◆ srv_
◆ sub_
◆ tf_
◆ tf_broadcaster_
◆ use_projected_center_
bool jsk_pcl_ros::HeightmapConverter::use_projected_center_ |
|
protected |
The documentation for this class was generated from the following files: