Public Types | Public Member Functions | Protected Member Functions | Protected Attributes
jsk_pcl_ros::MovingLeastSquareSmoothing Class Reference

#include <moving_least_square_smoothing.h>

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

List of all members.

Public Types

typedef
MovingLeastSquareSmoothingConfig 
Config

Public Member Functions

 MovingLeastSquareSmoothing ()

Protected Member Functions

virtual void configCallback (Config &config, uint32_t level)
virtual void onInit ()
virtual void smooth (const sensor_msgs::PointCloud2ConstPtr &input)
virtual void subscribe ()
virtual void unsubscribe ()

Protected Attributes

bool calc_normal_
bool gauss_param_set_
boost::mutex mutex_
int polynomial_order_
ros::Publisher pub_
double search_radius_
boost::shared_ptr
< dynamic_reconfigure::Server
< Config > > 
srv_
ros::Subscriber sub_input_
bool use_polynomial_fit_

Detailed Description

Definition at line 57 of file moving_least_square_smoothing.h.


Member Typedef Documentation

typedef MovingLeastSquareSmoothingConfig jsk_pcl_ros::MovingLeastSquareSmoothing::Config

Definition at line 60 of file moving_least_square_smoothing.h.


Constructor & Destructor Documentation

Definition at line 61 of file moving_least_square_smoothing.h.


Member Function Documentation

void jsk_pcl_ros::MovingLeastSquareSmoothing::configCallback ( Config config,
uint32_t  level 
) [protected, virtual]

Definition at line 85 of file moving_least_square_smoothing_nodelet.cpp.

void jsk_pcl_ros::MovingLeastSquareSmoothing::onInit ( void  ) [protected, virtual]

Reimplemented from jsk_topic_tools::DiagnosticNodelet.

Definition at line 95 of file moving_least_square_smoothing_nodelet.cpp.

void jsk_pcl_ros::MovingLeastSquareSmoothing::smooth ( const sensor_msgs::PointCloud2ConstPtr &  input) [protected, virtual]

Definition at line 45 of file moving_least_square_smoothing_nodelet.cpp.


Member Data Documentation

Definition at line 72 of file moving_least_square_smoothing.h.

Definition at line 71 of file moving_least_square_smoothing.h.

Definition at line 76 of file moving_least_square_smoothing.h.

Definition at line 75 of file moving_least_square_smoothing.h.

Definition at line 70 of file moving_least_square_smoothing.h.

Definition at line 73 of file moving_least_square_smoothing.h.

boost::shared_ptr<dynamic_reconfigure::Server<Config> > jsk_pcl_ros::MovingLeastSquareSmoothing::srv_ [protected]

Definition at line 77 of file moving_least_square_smoothing.h.

Definition at line 69 of file moving_least_square_smoothing.h.

Definition at line 74 of file moving_least_square_smoothing.h.


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


jsk_pcl_ros
Author(s): Yohei Kakiuchi
autogenerated on Sun Oct 8 2017 02:43:51