#include <moving_least_square_smoothing.h>
|
| typedef MovingLeastSquareSmoothingConfig | Config |
| |
◆ Config
◆ MovingLeastSquareSmoothing()
| jsk_pcl_ros::MovingLeastSquareSmoothing::MovingLeastSquareSmoothing |
( |
| ) |
|
|
inline |
◆ configCallback()
| void jsk_pcl_ros::MovingLeastSquareSmoothing::configCallback |
( |
Config & |
config, |
|
|
uint32_t |
level |
|
) |
| |
|
protectedvirtual |
◆ onInit()
| void jsk_pcl_ros::MovingLeastSquareSmoothing::onInit |
( |
| ) |
|
|
protectedvirtual |
◆ smooth()
| void jsk_pcl_ros::MovingLeastSquareSmoothing::smooth |
( |
const sensor_msgs::PointCloud2ConstPtr & |
input | ) |
|
|
protectedvirtual |
◆ subscribe()
| void jsk_pcl_ros::MovingLeastSquareSmoothing::subscribe |
( |
| ) |
|
|
protectedvirtual |
◆ unsubscribe()
| void jsk_pcl_ros::MovingLeastSquareSmoothing::unsubscribe |
( |
| ) |
|
|
protectedvirtual |
◆ calc_normal_
| bool jsk_pcl_ros::MovingLeastSquareSmoothing::calc_normal_ |
|
protected |
◆ gauss_param_set_
| bool jsk_pcl_ros::MovingLeastSquareSmoothing::gauss_param_set_ |
|
protected |
◆ mutex_
| boost::mutex jsk_pcl_ros::MovingLeastSquareSmoothing::mutex_ |
|
protected |
◆ polynomial_order_
| int jsk_pcl_ros::MovingLeastSquareSmoothing::polynomial_order_ |
|
protected |
◆ pub_
◆ search_radius_
| double jsk_pcl_ros::MovingLeastSquareSmoothing::search_radius_ |
|
protected |
◆ srv_
◆ sub_input_
◆ use_polynomial_fit_
| bool jsk_pcl_ros::MovingLeastSquareSmoothing::use_polynomial_fit_ |
|
protected |
The documentation for this class was generated from the following files: