From 1d1429a7068cfc12c2d0528f74a4c24cc992a29b Mon Sep 17 00:00:00 2001 From: Heiko Thiel Date: Tue, 7 May 2019 21:30:42 +0200 Subject: [PATCH] Changes are done by run-clang-tidy -header-filter='.*' -checks='-*,readability-redundant-member-init' -fix --- .../src/tools/openni_frame_source.cpp | 2 +- apps/cloud_composer/src/cloud_view.cpp | 3 +- .../click_trackball_interactor_style.cpp | 1 - .../rectangular_frustum_selector.cpp | 1 - .../selected_trackball_interactor_style.cpp | 1 - apps/cloud_composer/src/project_model.cpp | 1 - apps/cloud_composer/src/properties_model.cpp | 1 - apps/cloud_composer/src/toolbox_model.cpp | 1 - .../apps/in_hand_scanner/in_hand_scanner.h | 4 +- .../in_hand_scanner/offline_integration.h | 4 +- apps/in_hand_scanner/src/in_hand_scanner.cpp | 5 --- .../src/offline_integration.cpp | 5 --- apps/in_hand_scanner/src/opengl_viewer.cpp | 8 +--- apps/include/pcl/apps/nn_classification.h | 2 +- apps/include/pcl/apps/vfh_nn_classifier.h | 2 +- .../include/pcl/apps/modeler/main_window.h | 2 +- apps/modeler/src/channel_actor_item.cpp | 1 - apps/modeler/src/cloud_mesh_item.cpp | 3 -- apps/modeler/src/render_window_item.cpp | 1 - .../face_detection/openni_frame_source.cpp | 2 +- apps/src/ni_agast.cpp | 1 - apps/src/openni_fast_mesh.cpp | 2 +- apps/src/openni_klt.cpp | 3 +- apps/src/openni_passthrough.cpp | 7 +-- common/include/pcl/ModelCoefficients.h | 2 +- common/include/pcl/PCLHeader.h | 2 +- common/include/pcl/PCLImage.h | 4 +- common/include/pcl/PCLPointCloud2.h | 4 +- common/include/pcl/PCLPointField.h | 2 +- common/include/pcl/PointIndices.h | 2 +- common/include/pcl/PolygonMesh.h | 2 +- common/include/pcl/TextureMesh.h | 5 +-- common/include/pcl/Vertices.h | 2 +- common/include/pcl/common/pca.h | 4 -- common/include/pcl/common/synchronizer.h | 2 +- common/include/pcl/console/time.h | 2 +- common/include/pcl/impl/pcl_base.hpp | 1 - common/src/bearing_angle_image.cpp | 4 +- common/src/pcl_base.cpp | 4 +- common/src/poses_from_matches.cpp | 2 +- common/src/range_image.cpp | 4 +- common/src/range_image_planar.cpp | 2 +- common/src/time_trigger.cpp | 12 +---- features/include/pcl/features/3dsc.h | 1 - features/include/pcl/features/board.h | 7 +-- features/include/pcl/features/cvfh.h | 4 +- features/include/pcl/features/esf.h | 2 +- features/include/pcl/features/fpfh.h | 1 - .../impl/moment_of_inertia_estimation.hpp | 5 +-- .../impl/multiscale_feature_persistence.hpp | 7 +-- .../include/pcl/features/integral_image2D.h | 3 +- .../include/pcl/features/moment_invariants.h | 2 +- features/include/pcl/features/normal_3d.h | 2 - features/include/pcl/features/our_cvfh.h | 3 +- features/include/pcl/features/pfh.h | 3 -- features/include/pcl/features/pfhrgb.h | 2 +- .../pcl/features/principal_curvatures.h | 1 - .../features/range_image_border_extractor.h | 3 +- features/include/pcl/features/shot.h | 2 +- ...al_multiscale_interest_region_extraction.h | 3 +- features/include/pcl/features/vfh.h | 3 +- features/src/narf.cpp | 6 +-- features/src/range_image_border_extractor.cpp | 4 +- .../pcl/filters/approximate_voxel_grid.h | 2 +- .../include/pcl/filters/conditional_removal.h | 6 +-- filters/include/pcl/filters/crop_hull.h | 1 - filters/include/pcl/filters/filter.h | 4 +- .../pcl/filters/impl/conditional_removal.hpp | 4 +- .../include/pcl/filters/impl/convolution.hpp | 1 - filters/include/pcl/filters/project_inliers.h | 4 +- .../pcl/filters/radius_outlier_removal.h | 2 +- .../pcl/filters/statistical_outlier_removal.h | 2 +- filters/include/pcl/filters/voxel_grid.h | 2 - .../pcl/filters/voxel_grid_covariance.h | 2 - geometry/include/pcl/geometry/mesh_base.h | 12 +---- .../include/pcl/geometry/planar_polygon.h | 2 +- io/include/pcl/compression/color_coding.h | 3 +- .../pcl/compression/entropy_range_coder.h | 4 +- .../octree_pointcloud_compression.h | 5 --- io/include/pcl/compression/point_coding.h | 2 +- io/include/pcl/io/grabber.h | 2 +- io/include/pcl/io/image_grabber.h | 2 +- io/include/pcl/io/impl/synchronized_queue.hpp | 2 +- io/include/pcl/io/lzf_image_io.h | 18 ++++---- .../pcl/io/openni2/openni2_frame_listener.h | 2 +- io/include/pcl/io/pcd_grabber.h | 2 +- io/include/pcl/io/pcd_io.h | 4 +- io/include/pcl/io/ply/ply_parser.h | 2 - io/include/pcl/io/ply_io.h | 10 ++--- io/src/hdl_grabber.cpp | 4 -- io/src/image_grabber.cpp | 15 ------- io/src/lzf_image_io.cpp | 1 - io/src/oni_grabber.cpp | 5 +-- io/src/openni2/openni2_device.cpp | 1 - io/src/openni2/openni2_device_manager.cpp | 3 -- io/src/openni2_grabber.cpp | 7 +-- io/src/openni_camera/openni_device.cpp | 45 +++---------------- io/src/openni_camera/openni_driver.cpp | 7 --- io/src/openni_grabber.cpp | 9 +--- io/src/pcd_grabber.cpp | 14 ------ io/tools/ply/ply2raw.cpp | 6 +-- .../include/pcl/kdtree/impl/kdtree_flann.hpp | 8 ++-- kdtree/include/pcl/kdtree/kdtree.h | 2 +- keypoints/include/pcl/keypoints/agast_2d.h | 1 - keypoints/include/pcl/keypoints/keypoint.h | 2 - .../include/pcl/keypoints/sift_keypoint.h | 2 +- .../keypoints/smoothed_surfaces_keypoint.h | 1 - keypoints/include/pcl/keypoints/susan.h | 1 - keypoints/src/narf_keypoint.cpp | 2 +- ml/include/pcl/ml/svm_wrapper.h | 3 +- .../pcl/octree/impl/octree2buf_base.hpp | 1 - .../include/pcl/octree/impl/octree_base.hpp | 3 +- octree/include/pcl/octree/octree_container.h | 15 +++---- octree/include/pcl/octree/octree_search.h | 2 +- outofcore/src/outofcore_base_data.cpp | 12 +---- outofcore/src/outofcore_node_data.cpp | 8 +--- .../recognition/cg/correspondence_grouping.h | 2 +- .../recognition/cg/geometric_consistency.h | 1 - .../include/pcl/recognition/cg/hough_3d.h | 5 +-- .../pcl/recognition/color_gradient_modality.h | 4 -- .../recognition/impl/implicit_shape_model.hpp | 3 -- recognition/include/pcl/recognition/linemod.h | 4 +- .../pcl/recognition/linemod/line_rgbd.h | 6 +-- .../sparse_quantized_multi_mod_template.h | 2 +- .../pcl/recognition/surface_normal_modality.h | 10 +---- recognition/src/dotmod.cpp | 3 +- recognition/src/linemod.cpp | 1 - recognition/src/mask_map.cpp | 2 +- .../registration/correspondence_estimation.h | 2 - .../registration/correspondence_rejection.h | 2 - .../correspondence_rejection_distance.h | 3 +- .../correspondence_rejection_features.h | 2 +- ...correspondence_rejection_median_distance.h | 1 - ...respondence_rejection_organized_boundary.h | 1 - ...orrespondence_rejection_sample_consensus.h | 1 - .../correspondence_rejection_surface_normal.h | 1 - .../correspondence_rejection_var_trimmed.h | 3 +- registration/include/pcl/registration/elch.h | 1 - .../pcl/registration/impl/ia_kfpcs.hpp | 1 - .../include/pcl/registration/impl/ndt.hpp | 5 --- .../include/pcl/registration/impl/ndt_2d.hpp | 2 +- .../impl/pyramid_feature_matching.hpp | 1 - ...ion_estimation_point_to_plane_weighted.hpp | 1 - .../pcl/registration/matching_candidate.h | 1 - .../pcl/registration/ppf_registration.h | 4 +- .../registration/pyramid_feature_matching.h | 6 +-- .../include/pcl/registration/registration.h | 4 +- .../include/pcl/sample_consensus/sac.h | 8 ---- .../include/pcl/sample_consensus/sac_model.h | 14 ------ .../pcl/sample_consensus/sac_model_cone.h | 2 +- .../sample_consensus/sac_model_registration.h | 4 -- .../include/pcl/search/impl/flann_search.hpp | 4 +- search/include/pcl/search/impl/search.hpp | 1 - search/include/pcl/search/organized.h | 1 - .../euclidean_cluster_comparator.h | 1 - .../segmentation/ground_plane_comparator.h | 1 - .../impl/min_cut_segmentation.hpp | 3 -- .../include/pcl/segmentation/planar_region.h | 8 ++-- .../plane_coefficient_comparator.h | 1 - .../plane_refinement_comparator.h | 6 +-- .../segmentation/seeded_hue_segmentation.h | 2 +- stereo/include/pcl/stereo/stereo_grabber.h | 2 +- stereo/src/stereo_grabber.cpp | 10 ----- .../pcl/surface/bilateral_upsampling.h | 6 +-- surface/include/pcl/surface/ear_clipping.h | 2 +- surface/include/pcl/surface/gp3.h | 20 +-------- surface/include/pcl/surface/grid_projection.h | 2 +- .../pcl/surface/impl/grid_projection.hpp | 10 ++--- surface/include/pcl/surface/impl/mls.hpp | 2 +- surface/include/pcl/surface/mls.h | 5 --- surface/include/pcl/surface/processing.h | 2 +- surface/include/pcl/surface/texture_mapping.h | 6 +-- .../vtk_mesh_smoothing_laplacian.h | 4 +- .../vtk_mesh_smoothing_windowed_sinc.h | 3 +- .../vtk_mesh_quadric_decimation.cpp | 3 +- .../vtk_smoothing/vtk_mesh_subdivision.cpp | 3 +- test/octree/test_octree.cpp | 2 +- tools/oni_viewer_simple.cpp | 1 - tools/openni2_viewer.cpp | 1 - tools/openni_save_image.cpp | 3 -- tools/openni_viewer.cpp | 1 - tracking/include/pcl/tracking/coherence.h | 4 +- .../include/pcl/tracking/particle_filter.h | 4 -- tracking/include/pcl/tracking/tracker.h | 2 +- .../include/pcl/visualization/image_viewer.h | 2 +- .../pcl/visualization/interactor_style.h | 11 +++-- .../pcl/visualization/pcl_visualizer.h | 2 +- .../visualization/registration_visualizer.h | 6 --- .../src/common/ren_win_interact_map.cpp | 2 - visualization/src/histogram_visualizer.cpp | 1 - visualization/src/image_viewer.cpp | 8 +--- visualization/src/pcl_visualizer.cpp | 20 ++------- visualization/src/point_cloud_handlers.cpp | 2 +- visualization/src/range_image_visualizer.cpp | 2 +- visualization/src/window.cpp | 11 +---- 195 files changed, 183 insertions(+), 594 deletions(-) diff --git a/apps/3d_rec_framework/src/tools/openni_frame_source.cpp b/apps/3d_rec_framework/src/tools/openni_frame_source.cpp index 4bf10947256..739151b96b1 100644 --- a/apps/3d_rec_framework/src/tools/openni_frame_source.cpp +++ b/apps/3d_rec_framework/src/tools/openni_frame_source.cpp @@ -7,7 +7,7 @@ namespace OpenNIFrameSource { OpenNIFrameSource::OpenNIFrameSource (const std::string& device_id) : - grabber_ (device_id), most_recent_frame_ (), frame_counter_ (0), active_ (true) + grabber_ (device_id), frame_counter_ (0), active_ (true) { boost::function frame_cb = boost::bind (&OpenNIFrameSource::onNewFrame, this, _1); diff --git a/apps/cloud_composer/src/cloud_view.cpp b/apps/cloud_composer/src/cloud_view.cpp index 1898d1f6f08..59008d2dc7c 100644 --- a/apps/cloud_composer/src/cloud_view.cpp +++ b/apps/cloud_composer/src/cloud_view.cpp @@ -42,8 +42,7 @@ pcl::cloud_composer::CloudView::CloudView (ProjectModel* model, QWidget* parent) } pcl::cloud_composer::CloudView::CloudView (const CloudView& to_copy) - : QWidget () - , vis_ (to_copy.vis_) + : vis_ (to_copy.vis_) , model_ (to_copy.model_) , qvtk_ (to_copy.qvtk_) { diff --git a/apps/cloud_composer/src/point_selectors/click_trackball_interactor_style.cpp b/apps/cloud_composer/src/point_selectors/click_trackball_interactor_style.cpp index 1dc4188b663..e316c55f877 100644 --- a/apps/cloud_composer/src/point_selectors/click_trackball_interactor_style.cpp +++ b/apps/cloud_composer/src/point_selectors/click_trackball_interactor_style.cpp @@ -13,7 +13,6 @@ namespace pcl } pcl::cloud_composer::ClickTrackballStyleInteractor::ClickTrackballStyleInteractor () - : vtkInteractorStyleTrackballActor () { manipulation_complete_event_ = interactor_events::MANIPULATION_COMPLETE_EVENT; start_matrix_= vtkSmartPointer::New (); diff --git a/apps/cloud_composer/src/point_selectors/rectangular_frustum_selector.cpp b/apps/cloud_composer/src/point_selectors/rectangular_frustum_selector.cpp index a67cb803303..c237692c5fa 100644 --- a/apps/cloud_composer/src/point_selectors/rectangular_frustum_selector.cpp +++ b/apps/cloud_composer/src/point_selectors/rectangular_frustum_selector.cpp @@ -12,7 +12,6 @@ namespace pcl } pcl::cloud_composer::RectangularFrustumSelector::RectangularFrustumSelector () - : vtkInteractorStyleRubberBandPick () { selection_complete_event_ = interactor_events::SELECTION_COMPLETE_EVENT; } diff --git a/apps/cloud_composer/src/point_selectors/selected_trackball_interactor_style.cpp b/apps/cloud_composer/src/point_selectors/selected_trackball_interactor_style.cpp index 4af0436ce1b..c312cf705da 100644 --- a/apps/cloud_composer/src/point_selectors/selected_trackball_interactor_style.cpp +++ b/apps/cloud_composer/src/point_selectors/selected_trackball_interactor_style.cpp @@ -13,7 +13,6 @@ namespace pcl } pcl::cloud_composer::SelectedTrackballStyleInteractor::SelectedTrackballStyleInteractor () - : vtkInteractorStyleTrackballActor () { manipulation_complete_event_ = interactor_events::MANIPULATION_COMPLETE_EVENT; } diff --git a/apps/cloud_composer/src/project_model.cpp b/apps/cloud_composer/src/project_model.cpp index be5494f0c9c..cf39bc04401 100644 --- a/apps/cloud_composer/src/project_model.cpp +++ b/apps/cloud_composer/src/project_model.cpp @@ -53,7 +53,6 @@ pcl::cloud_composer::ProjectModel::ProjectModel (QObject* parent) } pcl::cloud_composer::ProjectModel::ProjectModel (const ProjectModel&) - : QStandardItemModel () { } diff --git a/apps/cloud_composer/src/properties_model.cpp b/apps/cloud_composer/src/properties_model.cpp index 86279970bfa..402d480a0e5 100644 --- a/apps/cloud_composer/src/properties_model.cpp +++ b/apps/cloud_composer/src/properties_model.cpp @@ -22,7 +22,6 @@ pcl::cloud_composer::PropertiesModel::PropertiesModel (CloudComposerItem* parent } pcl::cloud_composer::PropertiesModel::PropertiesModel (const PropertiesModel& to_copy) - : QStandardItemModel () { for (int i=0; i < to_copy.rowCount (); ++i){ QList new_row; diff --git a/apps/cloud_composer/src/toolbox_model.cpp b/apps/cloud_composer/src/toolbox_model.cpp index 7eb18f7b2dd..628aa79d230 100644 --- a/apps/cloud_composer/src/toolbox_model.cpp +++ b/apps/cloud_composer/src/toolbox_model.cpp @@ -17,7 +17,6 @@ pcl::cloud_composer::ToolBoxModel::ToolBoxModel (QTreeView* tool_view, QTreeView } pcl::cloud_composer::ToolBoxModel::ToolBoxModel (const ToolBoxModel&) - : QStandardItemModel () { } diff --git a/apps/in_hand_scanner/include/pcl/apps/in_hand_scanner/in_hand_scanner.h b/apps/in_hand_scanner/include/pcl/apps/in_hand_scanner/in_hand_scanner.h index e5b2f0653a3..295d5dca3c6 100644 --- a/apps/in_hand_scanner/include/pcl/apps/in_hand_scanner/in_hand_scanner.h +++ b/apps/in_hand_scanner/include/pcl/apps/in_hand_scanner/in_hand_scanner.h @@ -216,7 +216,7 @@ namespace pcl class ComputationFPS : public Base::FPS { public: - ComputationFPS () : Base::FPS () {} + ComputationFPS () {} ~ComputationFPS () {} }; @@ -224,7 +224,7 @@ namespace pcl class VisualizationFPS : public Base::FPS { public: - VisualizationFPS () : Base::FPS () {} + VisualizationFPS () {} ~VisualizationFPS () {} }; diff --git a/apps/in_hand_scanner/include/pcl/apps/in_hand_scanner/offline_integration.h b/apps/in_hand_scanner/include/pcl/apps/in_hand_scanner/offline_integration.h index 1371bece418..30b2f49bbfe 100644 --- a/apps/in_hand_scanner/include/pcl/apps/in_hand_scanner/offline_integration.h +++ b/apps/in_hand_scanner/include/pcl/apps/in_hand_scanner/offline_integration.h @@ -131,7 +131,7 @@ namespace pcl class ComputationFPS : public Base::FPS { public: - ComputationFPS () : Base::FPS () {} + ComputationFPS () {} ~ComputationFPS () {} }; @@ -140,7 +140,7 @@ namespace pcl class VisualizationFPS : public Base::FPS { public: - VisualizationFPS () : Base::FPS () {} + VisualizationFPS () {} ~VisualizationFPS () {} }; diff --git a/apps/in_hand_scanner/src/in_hand_scanner.cpp b/apps/in_hand_scanner/src/in_hand_scanner.cpp index e4cffe42123..46179a29b8f 100644 --- a/apps/in_hand_scanner/src/in_hand_scanner.cpp +++ b/apps/in_hand_scanner/src/in_hand_scanner.cpp @@ -63,14 +63,9 @@ pcl::ihs::InHandScanner::InHandScanner (Base* parent) : Base (parent), - mutex_ (), - computation_fps_ (), - visualization_fps_ (), running_mode_ (RM_UNPROCESSED), iteration_ (0), - grabber_ (), starting_grabber_ (false), - new_data_connection_ (), input_data_processing_ (new InputDataProcessing ()), icp_ (new ICP ()), transformation_ (Eigen::Matrix4f::Identity ()), diff --git a/apps/in_hand_scanner/src/offline_integration.cpp b/apps/in_hand_scanner/src/offline_integration.cpp index 39dc165e333..9c2ef3306aa 100644 --- a/apps/in_hand_scanner/src/offline_integration.cpp +++ b/apps/in_hand_scanner/src/offline_integration.cpp @@ -61,11 +61,6 @@ pcl::ihs::OfflineIntegration::OfflineIntegration (Base* parent) : Base (parent), - mutex_ (), - mutex_quit_ (), - computation_fps_ (), - visualization_fps_ (), - path_dir_ (), mesh_model_ (new Mesh ()), normal_estimation_ (new NormalEstimation ()), integration_ (new Integration ()), diff --git a/apps/in_hand_scanner/src/opengl_viewer.cpp b/apps/in_hand_scanner/src/opengl_viewer.cpp index d8ec5ea7d1a..20c0fce8435 100644 --- a/apps/in_hand_scanner/src/opengl_viewer.cpp +++ b/apps/in_hand_scanner/src/opengl_viewer.cpp @@ -64,9 +64,7 @@ //////////////////////////////////////////////////////////////////////////////// pcl::ihs::detail::FaceVertexMesh::FaceVertexMesh () - : vertices (), - triangles (), - transformation (Eigen::Isometry3d::Identity ()) + : transformation (Eigen::Isometry3d::Identity ()) { } @@ -74,7 +72,6 @@ pcl::ihs::detail::FaceVertexMesh::FaceVertexMesh () pcl::ihs::detail::FaceVertexMesh::FaceVertexMesh (const Mesh& mesh, const Eigen::Isometry3d& T) : vertices (mesh.getVertexDataCloud ()), - triangles (), transformation (T) { if (typeid (Mesh::MeshTag) != typeid (pcl::geometry::TriangleMeshTag)) @@ -108,15 +105,12 @@ pcl::ihs::detail::FaceVertexMesh::FaceVertexMesh (const Mesh& mesh, const Eigen: pcl::ihs::OpenGLViewer::OpenGLViewer (QWidget* parent) : QGLWidget (parent), - mutex_vis_ (), timer_vis_ (new QTimer (this)), colormap_ (Colormap::Constant (255)), vis_conf_norm_ (1), - drawn_meshes_ (), mesh_representation_ (MR_POINTS), coloring_ (COL_RGB), draw_box_ (false), - box_coefficients_ (), scaling_factor_ (1.), R_cam_ (1., 0., 0., 0.), t_cam_ (0., 0., 0.), diff --git a/apps/include/pcl/apps/nn_classification.h b/apps/include/pcl/apps/nn_classification.h index 0cb84f4af9e..e63ecb08b79 100644 --- a/apps/include/pcl/apps/nn_classification.h +++ b/apps/include/pcl/apps/nn_classification.h @@ -67,7 +67,7 @@ namespace pcl public: - NNClassification () : tree_ (), classes_ (), labels_idx_ () {} + NNClassification () : tree_ () {} /** \brief Result is a list of class labels and scores */ typedef std::pair, std::vector > Result; diff --git a/apps/include/pcl/apps/vfh_nn_classifier.h b/apps/include/pcl/apps/vfh_nn_classifier.h index 4a406cfac2f..df9efd7ffd2 100644 --- a/apps/include/pcl/apps/vfh_nn_classifier.h +++ b/apps/include/pcl/apps/vfh_nn_classifier.h @@ -110,7 +110,7 @@ namespace pcl public: - VFHClassifierNN () : training_features_ (), labels_ (), classifier_ () + VFHClassifierNN () { reset (); } diff --git a/apps/modeler/include/pcl/apps/modeler/main_window.h b/apps/modeler/include/pcl/apps/modeler/main_window.h index a70667a2006..25c5962f343 100755 --- a/apps/modeler/include/pcl/apps/modeler/main_window.h +++ b/apps/modeler/include/pcl/apps/modeler/main_window.h @@ -128,7 +128,7 @@ namespace pcl friend class AbstractItem; MainWindow(); - MainWindow(const MainWindow &) : QMainWindow () {} // copy ctor hidden + MainWindow(const MainWindow &) {} // copy ctor hidden MainWindow& operator=(const MainWindow &) { return (*this); } // assign op. hidden ~MainWindow(); diff --git a/apps/modeler/src/channel_actor_item.cpp b/apps/modeler/src/channel_actor_item.cpp index d5099b29262..2a2568472a5 100755 --- a/apps/modeler/src/channel_actor_item.cpp +++ b/apps/modeler/src/channel_actor_item.cpp @@ -52,7 +52,6 @@ pcl::modeler::ChannelActorItem::ChannelActorItem(QTreeWidgetItem* parent, const vtkSmartPointer& actor, const std::string& channel_name) :QTreeWidgetItem(parent), - AbstractItem(), cloud_mesh_(cloud_mesh), poly_data_(vtkSmartPointer::New()), render_window_(render_window), diff --git a/apps/modeler/src/cloud_mesh_item.cpp b/apps/modeler/src/cloud_mesh_item.cpp index 1c06c00026a..b46f47cb966 100755 --- a/apps/modeler/src/cloud_mesh_item.cpp +++ b/apps/modeler/src/cloud_mesh_item.cpp @@ -51,7 +51,6 @@ ////////////////////////////////////////////////////////////////////////////////////////////// pcl::modeler::CloudMeshItem::CloudMeshItem (QTreeWidgetItem* parent, const std::string& filename) :QTreeWidgetItem(parent), - AbstractItem(), filename_(filename), cloud_mesh_(new CloudMesh), translation_x_(new DoubleParameter("Translation X", "Translation X", 0.0, -1.0, 1.0)), @@ -68,7 +67,6 @@ pcl::modeler::CloudMeshItem::CloudMeshItem (QTreeWidgetItem* parent, const std:: ////////////////////////////////////////////////////////////////////////////////////////////// pcl::modeler::CloudMeshItem::CloudMeshItem (QTreeWidgetItem* parent, CloudMesh::PointCloudPtr cloud) :QTreeWidgetItem(parent), - AbstractItem(), filename_("unnamed point cloud"), cloud_mesh_(new CloudMesh (cloud)), translation_x_(new DoubleParameter("Translation X", "Translation X", 0.0, -1.0, 1.0)), @@ -89,7 +87,6 @@ pcl::modeler::CloudMeshItem::CloudMeshItem (QTreeWidgetItem* parent, CloudMesh:: ////////////////////////////////////////////////////////////////////////////////////////////// pcl::modeler::CloudMeshItem::CloudMeshItem(QTreeWidgetItem* parent, const CloudMeshItem& cloud_mesh_item) :QTreeWidgetItem(parent), - AbstractItem(), filename_(cloud_mesh_item.filename_), cloud_mesh_(cloud_mesh_item.cloud_mesh_), translation_x_(new DoubleParameter("Translation X", "Translation X", 0.0, -1.0, 1.0)), diff --git a/apps/modeler/src/render_window_item.cpp b/apps/modeler/src/render_window_item.cpp index 2536a38a962..164e6bb3c45 100755 --- a/apps/modeler/src/render_window_item.cpp +++ b/apps/modeler/src/render_window_item.cpp @@ -45,7 +45,6 @@ ////////////////////////////////////////////////////////////////////////////////////////////// pcl::modeler::RenderWindowItem::RenderWindowItem(QTreeWidget * parent) : QTreeWidgetItem(parent), - AbstractItem(), render_window_(new RenderWindow(this)), background_color_(new ColorParameter("Background Color", "The background color of the render window", QColor(0, 0, 0))), show_axes_(new BoolParameter("Show Axes", "Show Axes", true)) diff --git a/apps/src/face_detection/openni_frame_source.cpp b/apps/src/face_detection/openni_frame_source.cpp index cd112b97f0c..b27c3063999 100644 --- a/apps/src/face_detection/openni_frame_source.cpp +++ b/apps/src/face_detection/openni_frame_source.cpp @@ -7,7 +7,7 @@ namespace OpenNIFrameSource { OpenNIFrameSource::OpenNIFrameSource(const std::string& device_id) : - grabber_ (device_id), most_recent_frame_ (), frame_counter_ (0), active_ (true) + grabber_ (device_id), frame_counter_ (0), active_ (true) { boost::function frame_cb = boost::bind (&OpenNIFrameSource::onNewFrame, this, _1); grabber_.registerCallback (frame_cb); diff --git a/apps/src/ni_agast.cpp b/apps/src/ni_agast.cpp index a3706594b4b..14060cce41d 100644 --- a/apps/src/ni_agast.cpp +++ b/apps/src/ni_agast.cpp @@ -76,7 +76,6 @@ class AGASTDemo , bmax_ (255) , threshold_ (30) , detector_type_ (0) - , timer_ () { } diff --git a/apps/src/openni_fast_mesh.cpp b/apps/src/openni_fast_mesh.cpp index 0ff7f0cec2d..2aa166951fa 100644 --- a/apps/src/openni_fast_mesh.cpp +++ b/apps/src/openni_fast_mesh.cpp @@ -73,7 +73,7 @@ class OpenNIFastMesh typedef typename Cloud::ConstPtr CloudConstPtr; OpenNIFastMesh (const std::string& device_id = "") - : device_id_(device_id), vertices_ () + : device_id_(device_id) { ofm.setTrianglePixelSize (3); ofm.setTriangulationType (pcl::OrganizedFastMesh::QUAD_MESH); diff --git a/apps/src/openni_klt.cpp b/apps/src/openni_klt.cpp index e7a98ea0af4..ed2f26f7955 100644 --- a/apps/src/openni_klt.cpp +++ b/apps/src/openni_klt.cpp @@ -109,8 +109,7 @@ class OpenNIViewer typedef typename Cloud::ConstPtr CloudConstPtr; OpenNIViewer (pcl::Grabber& grabber) - : image_viewer_ () - , grabber_ (grabber) + : grabber_ (grabber) , rgb_data_ (nullptr), rgb_data_size_ (0) { } diff --git a/apps/src/openni_passthrough.cpp b/apps/src/openni_passthrough.cpp index cb2bf8cc211..e3a31aff7cf 100644 --- a/apps/src/openni_passthrough.cpp +++ b/apps/src/openni_passthrough.cpp @@ -52,12 +52,7 @@ using namespace std::chrono_literals; //////////////////////////////////////////////////////////////////////////////////////////////////////////////////////// OpenNIPassthrough::OpenNIPassthrough (pcl::OpenNIGrabber& grabber) - : vis_ () - , grabber_(grabber) - , device_id_ () - , cloud_pass_() - , pass_ () - , mtx_ () + : grabber_(grabber) , ui_ (new Ui::MainWindow) , vis_timer_ (new QTimer (this)) { diff --git a/common/include/pcl/ModelCoefficients.h b/common/include/pcl/ModelCoefficients.h index dfbab2a786e..3790ef0030c 100644 --- a/common/include/pcl/ModelCoefficients.h +++ b/common/include/pcl/ModelCoefficients.h @@ -11,7 +11,7 @@ namespace pcl { struct ModelCoefficients { - ModelCoefficients () : header (), values () + ModelCoefficients () { } diff --git a/common/include/pcl/PCLHeader.h b/common/include/pcl/PCLHeader.h index affc7ffdbe5..f8027516b1c 100644 --- a/common/include/pcl/PCLHeader.h +++ b/common/include/pcl/PCLHeader.h @@ -14,7 +14,7 @@ namespace pcl { struct PCLHeader { - PCLHeader (): seq (0), stamp (), frame_id () + PCLHeader (): seq (0), stamp () {} /** \brief Sequence number */ diff --git a/common/include/pcl/PCLImage.h b/common/include/pcl/PCLImage.h index 3e291529ef5..a0c0e039d4e 100644 --- a/common/include/pcl/PCLImage.h +++ b/common/include/pcl/PCLImage.h @@ -15,8 +15,8 @@ namespace pcl { struct PCLImage { - PCLImage () : header (), height (0), width (0), encoding (), - is_bigendian (0), step (0), data () + PCLImage () : height (0), width (0), + is_bigendian (0), step (0) {} ::pcl::PCLHeader header; diff --git a/common/include/pcl/PCLPointCloud2.h b/common/include/pcl/PCLPointCloud2.h index be8230e0e2b..4c7827b78bf 100644 --- a/common/include/pcl/PCLPointCloud2.h +++ b/common/include/pcl/PCLPointCloud2.h @@ -18,9 +18,9 @@ namespace pcl struct PCLPointCloud2 { - PCLPointCloud2 () : header (), height (0), width (0), fields (), + PCLPointCloud2 () : height (0), width (0), is_bigendian (false), point_step (0), row_step (0), - data (), is_dense (false) + is_dense (false) { #if BOOST_ENDIAN_BIG_BYTE is_bigendian = true; diff --git a/common/include/pcl/PCLPointField.h b/common/include/pcl/PCLPointField.h index 0aa52fd8572..956ba803b74 100644 --- a/common/include/pcl/PCLPointField.h +++ b/common/include/pcl/PCLPointField.h @@ -14,7 +14,7 @@ namespace pcl { struct PCLPointField { - PCLPointField () : name (), offset (0), datatype (0), count (0) + PCLPointField () : offset (0), datatype (0), count (0) {} std::string name; diff --git a/common/include/pcl/PointIndices.h b/common/include/pcl/PointIndices.h index d1320362fc6..9091f693a2b 100644 --- a/common/include/pcl/PointIndices.h +++ b/common/include/pcl/PointIndices.h @@ -11,7 +11,7 @@ namespace pcl { struct PointIndices { - PointIndices () : header (), indices () + PointIndices () {} ::pcl::PCLHeader header; diff --git a/common/include/pcl/PolygonMesh.h b/common/include/pcl/PolygonMesh.h index b4719c7f36e..2957b5b435e 100644 --- a/common/include/pcl/PolygonMesh.h +++ b/common/include/pcl/PolygonMesh.h @@ -14,7 +14,7 @@ namespace pcl { struct PolygonMesh { - PolygonMesh () : header (), cloud (), polygons () + PolygonMesh () {} ::pcl::PCLHeader header; diff --git a/common/include/pcl/TextureMesh.h b/common/include/pcl/TextureMesh.h index 3a58c2656dc..51dbbd4b4e4 100644 --- a/common/include/pcl/TextureMesh.h +++ b/common/include/pcl/TextureMesh.h @@ -48,7 +48,7 @@ namespace pcl /** \author Khai Tran */ struct TexMaterial { - TexMaterial () : tex_name (), tex_file (), tex_Ka (), tex_Kd (), tex_Ks (), tex_d (), tex_Ns (), tex_illum () {} + TexMaterial () : tex_Ka (), tex_Kd (), tex_Ks (), tex_d (), tex_Ns (), tex_illum () {} struct RGB { @@ -89,8 +89,7 @@ namespace pcl /** \author Khai Tran */ struct TextureMesh { - TextureMesh () : - cloud (), tex_polygons (), tex_coordinates (), tex_materials () {} + TextureMesh () {} pcl::PCLPointCloud2 cloud; pcl::PCLHeader header; diff --git a/common/include/pcl/Vertices.h b/common/include/pcl/Vertices.h index f222c57527b..666bdeb61dd 100644 --- a/common/include/pcl/Vertices.h +++ b/common/include/pcl/Vertices.h @@ -13,7 +13,7 @@ namespace pcl */ struct Vertices { - Vertices () : vertices () + Vertices () {} std::vector vertices; diff --git a/common/include/pcl/common/pca.h b/common/include/pcl/common/pca.h index 6c6e6af70d3..63a96db24c0 100644 --- a/common/include/pcl/common/pca.h +++ b/common/include/pcl/common/pca.h @@ -89,10 +89,6 @@ namespace pcl : Base () , compute_done_ (false) , basis_only_ (basis_only) - , eigenvectors_ () - , coefficients_ () - , mean_ () - , eigenvalues_ () {} /** Copy Constructor diff --git a/common/include/pcl/common/synchronizer.h b/common/include/pcl/common/synchronizer.h index 8df15531881..05bf1761b60 100644 --- a/common/include/pcl/common/synchronizer.h +++ b/common/include/pcl/common/synchronizer.h @@ -64,7 +64,7 @@ namespace pcl int callback_counter; public: - Synchronizer () : mutex1_ (), mutex2_ (), publish_mutex_ (), queueT1 (), queueT2 (), cb_ (), callback_counter (0) { }; + Synchronizer () : queueT1 (), queueT2 (), cb_ (), callback_counter (0) { }; int addCallback (const CallbackFunction& callback) diff --git a/common/include/pcl/console/time.h b/common/include/pcl/console/time.h index 9df55cb3190..dc7779e0a71 100644 --- a/common/include/pcl/console/time.h +++ b/common/include/pcl/console/time.h @@ -50,7 +50,7 @@ namespace pcl { public: - TicToc () : tictic_ () {} + TicToc () {} void tic () diff --git a/common/include/pcl/impl/pcl_base.hpp b/common/include/pcl/impl/pcl_base.hpp index 88b8e5dc0b1..60dd2af7f59 100644 --- a/common/include/pcl/impl/pcl_base.hpp +++ b/common/include/pcl/impl/pcl_base.hpp @@ -45,7 +45,6 @@ template pcl::PCLBase::PCLBase () : input_ () - , indices_ () , use_indices_ (false) , fake_indices_ (false) { diff --git a/common/src/bearing_angle_image.cpp b/common/src/bearing_angle_image.cpp index bdb72b57e64..5e0df8cf1d1 100644 --- a/common/src/bearing_angle_image.cpp +++ b/common/src/bearing_angle_image.cpp @@ -46,9 +46,7 @@ namespace pcl { ///////////////////////////////////////////////////////// -BearingAngleImage::BearingAngleImage () : - BearingAngleImage::BaseClass (), - unobserved_point_ () +BearingAngleImage::BearingAngleImage () { reset (); unobserved_point_.x = unobserved_point_.y = unobserved_point_.z = 0.0; diff --git a/common/src/pcl_base.cpp b/common/src/pcl_base.cpp index 363bd71f9aa..aacbeaaf242 100644 --- a/common/src/pcl_base.cpp +++ b/common/src/pcl_base.cpp @@ -40,9 +40,7 @@ /////////////////////////////////////////////////////////////////////////////////////////// pcl::PCLBase::PCLBase () - : input_ () - , indices_ () - , use_indices_ (false) + : use_indices_ (false) , fake_indices_ (false) , field_sizes_ (0) , x_idx_ (-1) diff --git a/common/src/poses_from_matches.cpp b/common/src/poses_from_matches.cpp index 8e75354e2f3..7f91e71222e 100644 --- a/common/src/poses_from_matches.cpp +++ b/common/src/poses_from_matches.cpp @@ -42,7 +42,7 @@ #include ////////////////////////////////////////////////////////////////////////////////////////////////////////////////////// -pcl::PosesFromMatches::PosesFromMatches () : parameters_ () +pcl::PosesFromMatches::PosesFromMatches () { } diff --git a/common/src/range_image.cpp b/common/src/range_image.cpp index 4942ac1aadb..86592f4fe53 100644 --- a/common/src/range_image.cpp +++ b/common/src/range_image.cpp @@ -105,13 +105,11 @@ RangeImage::getCoordinateFrameTransformation (RangeImage::CoordinateFrame coordi ///////////////////////////////////////////////////////////////////////// RangeImage::RangeImage () : - RangeImage::BaseClass (), to_range_image_system_ (Eigen::Affine3f::Identity ()), to_world_system_ (Eigen::Affine3f::Identity ()), angular_resolution_x_ (0), angular_resolution_y_ (0), angular_resolution_x_reciprocal_ (0), angular_resolution_y_reciprocal_ (0), - image_offset_x_ (0), image_offset_y_ (0), - unobserved_point () + image_offset_x_ (0), image_offset_y_ (0) { createLookupTables (); reset (); diff --git a/common/src/range_image_planar.cpp b/common/src/range_image_planar.cpp index 39f104a90d3..9726f98d6f0 100644 --- a/common/src/range_image_planar.cpp +++ b/common/src/range_image_planar.cpp @@ -43,7 +43,7 @@ using std::cerr; namespace pcl { ///////////////////////////////////////////////////////////////////////// - RangeImagePlanar::RangeImagePlanar () : RangeImage (), focal_length_x_ (0.0f), focal_length_y_ (0.0f), + RangeImagePlanar::RangeImagePlanar () : focal_length_x_ (0.0f), focal_length_y_ (0.0f), focal_length_x_reciprocal_ (0.0f), focal_length_y_reciprocal_ (0.0f), center_x_ (0.0f), center_y_ (0.0f) { diff --git a/common/src/time_trigger.cpp b/common/src/time_trigger.cpp index 6d85545feb4..4e6c0fbeb3d 100644 --- a/common/src/time_trigger.cpp +++ b/common/src/time_trigger.cpp @@ -41,13 +41,9 @@ ////////////////////////////////////////////////////////////////////////////////////////////// pcl::TimeTrigger::TimeTrigger (double interval, const callback_type& callback) -: callbacks_ () -, interval_ (interval) +: interval_ (interval) , quit_ (false) , running_ (false) -, timer_thread_ () -, condition_ () -, condition_mutex_ () { timer_thread_ = std::thread (&TimeTrigger::thread_function, this); registerCallback (callback); @@ -55,13 +51,9 @@ pcl::TimeTrigger::TimeTrigger (double interval, const callback_type& callback) ////////////////////////////////////////////////////////////////////////////////////////////// pcl::TimeTrigger::TimeTrigger (double interval) -: callbacks_ () -, interval_ (interval) +: interval_ (interval) , quit_ (false) , running_ (false) -, timer_thread_ () -, condition_ () -, condition_mutex_ () { timer_thread_ = std::thread (&TimeTrigger::thread_function, this); } diff --git a/features/include/pcl/features/3dsc.h b/features/include/pcl/features/3dsc.h index 7785d9ee26a..c1edd535496 100644 --- a/features/include/pcl/features/3dsc.h +++ b/features/include/pcl/features/3dsc.h @@ -104,7 +104,6 @@ namespace pcl min_radius_(0.1), point_density_radius_(0.2), descriptor_length_ (), - rng_ (), rng_dist_ (0.0f, 1.0f) { feature_name_ = "ShapeContext3DEstimation"; diff --git a/features/include/pcl/features/board.h b/features/include/pcl/features/board.h index 9039fff5d34..da154135f5c 100644 --- a/features/include/pcl/features/board.h +++ b/features/include/pcl/features/board.h @@ -68,12 +68,7 @@ namespace pcl margin_thresh_ (0.85f), check_margin_array_size_ (24), hole_size_prob_thresh_ (0.2f), - steep_thresh_ (0.1f), - check_margin_array_ (), - margin_array_min_angle_ (), - margin_array_max_angle_ (), - margin_array_min_angle_normal_ (), - margin_array_max_angle_normal_ () + steep_thresh_ (0.1f) { feature_name_ = "BOARDLocalReferenceFrameEstimation"; setCheckMarginArraySize (check_margin_array_size_); diff --git a/features/include/pcl/features/cvfh.h b/features/include/pcl/features/cvfh.h index 215759b2a03..2071081faa1 100644 --- a/features/include/pcl/features/cvfh.h +++ b/features/include/pcl/features/cvfh.h @@ -87,9 +87,7 @@ namespace pcl cluster_tolerance_ (leaf_size_ * 3), eps_angle_threshold_ (0.125f), min_points_ (50), - radius_normals_ (leaf_size_ * 3), - centroids_dominant_orientations_ (), - dominant_normals_ () + radius_normals_ (leaf_size_ * 3) { search_radius_ = 0; k_ = 1; diff --git a/features/include/pcl/features/esf.h b/features/include/pcl/features/esf.h index ffef6b296e3..793dc919e4d 100644 --- a/features/include/pcl/features/esf.h +++ b/features/include/pcl/features/esf.h @@ -74,7 +74,7 @@ namespace pcl typedef typename Feature::PointCloudOut PointCloudOut; /** \brief Empty constructor. */ - ESFEstimation () : lut_ (), local_cloud_ () + ESFEstimation () : local_cloud_ () { feature_name_ = "ESFEstimation"; lut_.resize (GRIDSIZE); diff --git a/features/include/pcl/features/fpfh.h b/features/include/pcl/features/fpfh.h index ec4ea8aac4f..97c6ec453a4 100644 --- a/features/include/pcl/features/fpfh.h +++ b/features/include/pcl/features/fpfh.h @@ -95,7 +95,6 @@ namespace pcl /** \brief Empty constructor. */ FPFHEstimation () : nr_bins_f1_ (11), nr_bins_f2_ (11), nr_bins_f3_ (11), - hist_f1_ (), hist_f2_ (), hist_f3_ (), fpfh_histogram_ (), d_pi_ (1.0f / (2.0f * static_cast (M_PI))) { feature_name_ = "FPFHEstimation"; diff --git a/features/include/pcl/features/impl/moment_of_inertia_estimation.hpp b/features/include/pcl/features/impl/moment_of_inertia_estimation.hpp index 3b34da0c28a..ba29d7f1d41 100644 --- a/features/include/pcl/features/impl/moment_of_inertia_estimation.hpp +++ b/features/include/pcl/features/impl/moment_of_inertia_estimation.hpp @@ -56,14 +56,11 @@ pcl::MomentOfInertiaEstimation::MomentOfInertiaEstimation () : major_value_ (0.0f), middle_value_ (0.0f), minor_value_ (0.0f), - moment_of_inertia_ (), - eccentricity_ (), aabb_min_point_ (), aabb_max_point_ (), obb_min_point_ (), obb_max_point_ (), - obb_position_ (0.0f, 0.0f, 0.0f), - obb_rotational_matrix_ () + obb_position_ (0.0f, 0.0f, 0.0f) { } diff --git a/features/include/pcl/features/impl/multiscale_feature_persistence.hpp b/features/include/pcl/features/impl/multiscale_feature_persistence.hpp index a8144446ab7..9c5fd5d3995 100644 --- a/features/include/pcl/features/impl/multiscale_feature_persistence.hpp +++ b/features/include/pcl/features/impl/multiscale_feature_persistence.hpp @@ -45,16 +45,11 @@ ////////////////////////////////////////////////////////////////////////////////////////////// template pcl::MultiscaleFeaturePersistence::MultiscaleFeaturePersistence () : - scale_values_ (), alpha_ (0), distance_metric_ (L1), feature_estimator_ (), features_at_scale_ (), - features_at_scale_vectorized_ (), - mean_feature_ (), - feature_representation_ (), - unique_features_indices_ (), - unique_features_table_ () + feature_representation_ () { feature_representation_.reset (new DefaultPointRepresentation); // No input is needed, hack around the initCompute () check from PCLBase diff --git a/features/include/pcl/features/integral_image2D.h b/features/include/pcl/features/integral_image2D.h index daa89c1c72f..570c369ed9e 100644 --- a/features/include/pcl/features/integral_image2D.h +++ b/features/include/pcl/features/integral_image2D.h @@ -119,7 +119,6 @@ namespace pcl IntegralImage2D (bool compute_second_order_integral_images) : first_order_integral_image_ (), second_order_integral_image_ (), - finite_values_integral_image_ (), width_ (1), height_ (1), compute_second_order_integral_images_ (compute_second_order_integral_images) @@ -244,7 +243,7 @@ namespace pcl IntegralImage2D (bool compute_second_order_integral_images) : first_order_integral_image_ (), second_order_integral_image_ (), - finite_values_integral_image_ (), + width_ (1), height_ (1), compute_second_order_integral_images_ (compute_second_order_integral_images) { diff --git a/features/include/pcl/features/moment_invariants.h b/features/include/pcl/features/moment_invariants.h index 67a19a6398b..88661750f99 100644 --- a/features/include/pcl/features/moment_invariants.h +++ b/features/include/pcl/features/moment_invariants.h @@ -68,7 +68,7 @@ namespace pcl typedef typename Feature::PointCloudOut PointCloudOut; /** \brief Empty constructor. */ - MomentInvariantsEstimation () : xyz_centroid_ (), temp_pt_ () + MomentInvariantsEstimation () { feature_name_ = "MomentInvariantsEstimation"; }; diff --git a/features/include/pcl/features/normal_3d.h b/features/include/pcl/features/normal_3d.h index 4667e5a159c..984d00e7d9e 100644 --- a/features/include/pcl/features/normal_3d.h +++ b/features/include/pcl/features/normal_3d.h @@ -260,8 +260,6 @@ namespace pcl : vpx_ (0) , vpy_ (0) , vpz_ (0) - , covariance_matrix_ () - , xyz_centroid_ () , use_sensor_origin_ (true) { feature_name_ = "NormalEstimation"; diff --git a/features/include/pcl/features/our_cvfh.h b/features/include/pcl/features/our_cvfh.h index 84871033c91..27369467d60 100644 --- a/features/include/pcl/features/our_cvfh.h +++ b/features/include/pcl/features/our_cvfh.h @@ -77,8 +77,7 @@ namespace pcl /** \brief Empty constructor. */ OURCVFHEstimation () : vpx_ (0), vpy_ (0), vpz_ (0), leaf_size_ (0.005f), normalize_bins_ (false), curv_threshold_ (0.03f), cluster_tolerance_ (leaf_size_ * 3), - eps_angle_threshold_ (0.125f), min_points_ (50), radius_normals_ (leaf_size_ * 3), centroids_dominant_orientations_ (), - dominant_normals_ () + eps_angle_threshold_ (0.125f), min_points_ (50), radius_normals_ (leaf_size_ * 3) { search_radius_ = 0; k_ = 1; diff --git a/features/include/pcl/features/pfh.h b/features/include/pcl/features/pfh.h index c626f2e136b..f5892f6456c 100644 --- a/features/include/pcl/features/pfh.h +++ b/features/include/pcl/features/pfh.h @@ -100,10 +100,7 @@ namespace pcl */ PFHEstimation () : nr_subdiv_ (5), - pfh_histogram_ (), - pfh_tuple_ (), d_pi_ (1.0f / (2.0f * static_cast (M_PI))), - feature_map_ (), key_list_ (), // Default 1GB memory size. Need to set it to something more conservative. max_cache_size_ ((1ul*1024ul*1024ul*1024ul) / sizeof (std::pair, Eigen::Vector4f>)), diff --git a/features/include/pcl/features/pfhrgb.h b/features/include/pcl/features/pfhrgb.h index bb83ed3c158..ca1fbe1f42b 100644 --- a/features/include/pcl/features/pfhrgb.h +++ b/features/include/pcl/features/pfhrgb.h @@ -60,7 +60,7 @@ namespace pcl PFHRGBEstimation () - : nr_subdiv_ (5), pfhrgb_histogram_ (), pfhrgb_tuple_ (), d_pi_ (1.0f / (2.0f * static_cast (M_PI))) + : nr_subdiv_ (5), d_pi_ (1.0f / (2.0f * static_cast (M_PI))) { feature_name_ = "PFHRGBEstimation"; } diff --git a/features/include/pcl/features/principal_curvatures.h b/features/include/pcl/features/principal_curvatures.h index 25be8b209ca..8322fce2bcb 100644 --- a/features/include/pcl/features/principal_curvatures.h +++ b/features/include/pcl/features/principal_curvatures.h @@ -76,7 +76,6 @@ namespace pcl /** \brief Empty constructor. */ PrincipalCurvaturesEstimation () : - projected_normals_ (), xyz_centroid_ (Eigen::Vector3f::Zero ()), demean_ (Eigen::Vector3f::Zero ()), covariance_matrix_ (Eigen::Matrix3f::Zero ()), diff --git a/features/include/pcl/features/range_image_border_extractor.h b/features/include/pcl/features/range_image_border_extractor.h index 10dc9df7a08..2928e6885c6 100644 --- a/features/include/pcl/features/range_image_border_extractor.h +++ b/features/include/pcl/features/range_image_border_extractor.h @@ -65,8 +65,7 @@ namespace pcl struct LocalSurface { LocalSurface () : - normal (), neighborhood_mean (), eigen_values (), normal_no_jumps (), - neighborhood_mean_no_jumps (), eigen_values_no_jumps (), max_neighbor_distance_squared () {} + max_neighbor_distance_squared () {} Eigen::Vector3f normal; Eigen::Vector3f neighborhood_mean; diff --git a/features/include/pcl/features/shot.h b/features/include/pcl/features/shot.h index 304f5b8b478..dac1c6fdc3f 100644 --- a/features/include/pcl/features/shot.h +++ b/features/include/pcl/features/shot.h @@ -90,7 +90,7 @@ namespace pcl */ SHOTEstimationBase (int nr_shape_bins = 10) : nr_shape_bins_ (nr_shape_bins), - shot_ (), lrf_radius_ (0), + lrf_radius_ (0), sqradius_ (0), radius3_4_ (0), radius1_4_ (0), radius1_2_ (0), nr_grid_sector_ (32), maxAngularSectors_ (32), diff --git a/features/include/pcl/features/statistical_multiscale_interest_region_extraction.h b/features/include/pcl/features/statistical_multiscale_interest_region_extraction.h index 64515144d5f..905bf919000 100644 --- a/features/include/pcl/features/statistical_multiscale_interest_region_extraction.h +++ b/features/include/pcl/features/statistical_multiscale_interest_region_extraction.h @@ -70,8 +70,7 @@ namespace pcl /** \brief Empty constructor */ - StatisticalMultiscaleInterestRegionExtraction () : - scale_values_ (), geodesic_distances_ (), F_scales_ () + StatisticalMultiscaleInterestRegionExtraction () {}; /** \brief Method that generates the underlying nearest neighbor graph based on the diff --git a/features/include/pcl/features/vfh.h b/features/include/pcl/features/vfh.h index 8679a7285fe..a94cab5258e 100644 --- a/features/include/pcl/features/vfh.h +++ b/features/include/pcl/features/vfh.h @@ -88,8 +88,7 @@ namespace pcl VFHEstimation () : nr_bins_f1_ (45), nr_bins_f2_ (45), nr_bins_f3_ (45), nr_bins_f4_ (45), nr_bins_vp_ (128), vpx_ (0), vpy_ (0), vpz_ (0), - hist_f1_ (), hist_f2_ (), hist_f3_ (), hist_f4_ (), hist_vp_ (), - normal_to_use_ (), centroid_to_use_ (), use_given_normal_ (false), use_given_centroid_ (false), + use_given_normal_ (false), use_given_centroid_ (false), normalize_bins_ (true), normalize_distances_ (false), size_component_ (false), d_pi_ (1.0f / (2.0f * static_cast (M_PI))) { diff --git a/features/src/narf.cpp b/features/src/narf.cpp index 7aa8178453a..bdeaf54d7a5 100644 --- a/features/src/narf.cpp +++ b/features/src/narf.cpp @@ -57,7 +57,7 @@ int Narf::max_no_of_threads = 1; ///////////////////////////////////////////////////////////////////////////////////////////////////////////////// Narf::Narf() : - position_ (), transformation_ (), surface_patch_ (nullptr), + surface_patch_ (nullptr), surface_patch_pixel_size_ (0), surface_patch_world_size_ (), surface_patch_rotation_ (), descriptor_ (nullptr), descriptor_size_ (0) { @@ -72,7 +72,7 @@ Narf::~Narf() ///////////////////////////////////////////////////////////////////////////////////////////////////////////////// Narf::Narf (const Narf& other) : - position_ (), transformation_ (), surface_patch_ (nullptr), + surface_patch_ (nullptr), surface_patch_pixel_size_ (0), surface_patch_world_size_ (), surface_patch_rotation_ (), descriptor_ (nullptr), descriptor_size_ (0) { @@ -605,7 +605,7 @@ Narf::loadBinary (const std::string& filename) ///////////////////////////////////////////////////////////////////////////////////////////////////////////////// ///////////////////////////////////////////////////////////////////////////////////////////////////////////////// NarfDescriptor::NarfDescriptor (const RangeImage* range_image, const std::vector* indices) : - BaseClass (), range_image_ (), parameters_ () + range_image_ () { setRangeImage (range_image, indices); } diff --git a/features/src/range_image_border_extractor.cpp b/features/src/range_image_border_extractor.cpp index 1143c95b751..1a23027e433 100644 --- a/features/src/range_image_border_extractor.cpp +++ b/features/src/range_image_border_extractor.cpp @@ -53,8 +53,8 @@ namespace pcl { /////////////////////////////////////////////////////////////////////////////////////////////////////////////// -RangeImageBorderExtractor::RangeImageBorderExtractor(const RangeImage* range_image) : BaseClass(), - parameters_ (), range_image_(range_image), range_image_size_during_extraction_(0), +RangeImageBorderExtractor::RangeImageBorderExtractor(const RangeImage* range_image) : + range_image_(range_image), range_image_size_during_extraction_(0), border_scores_left_(nullptr), border_scores_right_(nullptr), border_scores_top_(nullptr), border_scores_bottom_(nullptr), surface_structure_(nullptr), border_descriptions_(nullptr), shadow_border_informations_(nullptr), border_directions_(nullptr), surface_change_scores_(nullptr), surface_change_directions_(nullptr) diff --git a/filters/include/pcl/filters/approximate_voxel_grid.h b/filters/include/pcl/filters/approximate_voxel_grid.h index deab31bf9f0..4c8bda94045 100644 --- a/filters/include/pcl/filters/approximate_voxel_grid.h +++ b/filters/include/pcl/filters/approximate_voxel_grid.h @@ -110,7 +110,7 @@ namespace pcl private: struct he { - he () : ix (), iy (), iz (), count (0), centroid () {} + he () : ix (), iy (), iz (), count (0) {} int ix, iy, iz; int count; Eigen::VectorXf centroid; diff --git a/filters/include/pcl/filters/conditional_removal.h b/filters/include/pcl/filters/conditional_removal.h index 4bd5f4ea4f0..4264a5f5838 100644 --- a/filters/include/pcl/filters/conditional_removal.h +++ b/filters/include/pcl/filters/conditional_removal.h @@ -92,7 +92,7 @@ namespace pcl typedef boost::shared_ptr< const ComparisonBase > ConstPtr; /** \brief Constructor. */ - ComparisonBase () : capable_ (false), field_name_ (), offset_ (), op_ () {} + ComparisonBase () : capable_ (false), offset_ (), op_ () {} /** \brief Destructor. */ virtual ~ComparisonBase () {} @@ -228,7 +228,7 @@ namespace pcl private: PackedRGBComparison () : - component_name_ (), component_offset_ (), compare_val_ () + component_offset_ (), compare_val_ () { } // not allowed @@ -285,7 +285,7 @@ namespace pcl private: PackedHSIComparison () : - component_name_ (), component_id_ (), compare_val_ (), rgb_offset_ () + component_id_ (), compare_val_ (), rgb_offset_ () { } // not allowed }; diff --git a/filters/include/pcl/filters/crop_hull.h b/filters/include/pcl/filters/crop_hull.h index 93adb22201e..e1c841348cc 100644 --- a/filters/include/pcl/filters/crop_hull.h +++ b/filters/include/pcl/filters/crop_hull.h @@ -66,7 +66,6 @@ namespace pcl /** \brief Empty Constructor. */ CropHull () : - hull_polygons_(), hull_cloud_(), dim_(3), crop_outside_(true) diff --git a/filters/include/pcl/filters/filter.h b/filters/include/pcl/filters/filter.h index d5ee5f3b985..2eafa012717 100644 --- a/filters/include/pcl/filters/filter.h +++ b/filters/include/pcl/filters/filter.h @@ -100,7 +100,6 @@ namespace pcl */ Filter (bool extract_removed_indices = false) : removed_indices_ (new std::vector), - filter_name_ (), extract_removed_indices_ (extract_removed_indices) { } @@ -206,8 +205,7 @@ namespace pcl */ Filter (bool extract_removed_indices = false) : removed_indices_ (new std::vector), - extract_removed_indices_ (extract_removed_indices), - filter_name_ () + extract_removed_indices_ (extract_removed_indices) { } diff --git a/filters/include/pcl/filters/impl/conditional_removal.hpp b/filters/include/pcl/filters/impl/conditional_removal.hpp index 0775db252e8..0e971e35c14 100644 --- a/filters/include/pcl/filters/impl/conditional_removal.hpp +++ b/filters/include/pcl/filters/impl/conditional_removal.hpp @@ -380,7 +380,7 @@ pcl::PackedHSIComparison::evaluate (const PointT &point) const ////////////////////////////////////////////////////////////////////////// template pcl::TfQuadraticXYZComparison::TfQuadraticXYZComparison () : - comp_matr_ (), comp_vect_ (), comp_scalar_ (0.0) + comp_scalar_ (0.0) { // get all the fields std::vector point_fields; @@ -445,7 +445,7 @@ pcl::TfQuadraticXYZComparison::TfQuadraticXYZComparison (const pcl::Comp const Eigen::Vector3f &comparison_vector, const float &comparison_scalar, const Eigen::Affine3f &comparison_transform) : - comp_matr_ (), comp_vect_ (), comp_scalar_ (comparison_scalar) + comp_scalar_ (comparison_scalar) { // get all the fields std::vector point_fields; diff --git a/filters/include/pcl/filters/impl/convolution.hpp b/filters/include/pcl/filters/impl/convolution.hpp index bc13b3a45c0..34011292e99 100644 --- a/filters/include/pcl/filters/impl/convolution.hpp +++ b/filters/include/pcl/filters/impl/convolution.hpp @@ -48,7 +48,6 @@ pcl::filters::Convolution::Convolution () : borders_policy_ (BORDERS_POLICY_IGNORE) , distance_threshold_ (std::numeric_limits::infinity ()) , input_ () - , kernel_ () , half_width_ () , kernel_width_ () , threads_ (1) diff --git a/filters/include/pcl/filters/project_inliers.h b/filters/include/pcl/filters/project_inliers.h index 90eda9049ef..0a07ec26c03 100644 --- a/filters/include/pcl/filters/project_inliers.h +++ b/filters/include/pcl/filters/project_inliers.h @@ -84,7 +84,7 @@ namespace pcl /** \brief Empty constructor. */ - ProjectInliers () : model_ (), sacmodel_ (), model_type_ (), copy_all_data_ (false) + ProjectInliers () : sacmodel_ (), model_type_ (), copy_all_data_ (false) { filter_name_ = "ProjectInliers"; } @@ -188,7 +188,7 @@ namespace pcl public: /** \brief Empty constructor. */ - ProjectInliers () : model_type_ (), copy_all_data_ (false), copy_all_fields_ (true), model_ (), sacmodel_ () + ProjectInliers () : model_type_ (), copy_all_data_ (false), copy_all_fields_ (true) { filter_name_ = "ProjectInliers"; } diff --git a/filters/include/pcl/filters/radius_outlier_removal.h b/filters/include/pcl/filters/radius_outlier_removal.h index c46f01b8ea1..22e10f7d1ca 100644 --- a/filters/include/pcl/filters/radius_outlier_removal.h +++ b/filters/include/pcl/filters/radius_outlier_removal.h @@ -208,7 +208,7 @@ namespace pcl /** \brief Empty constructor. */ RadiusOutlierRemoval (bool extract_removed_indices = false) : Filter::Filter (extract_removed_indices), - search_radius_ (0.0), min_pts_radius_ (1), tree_ () + search_radius_ (0.0), min_pts_radius_ (1) { filter_name_ = "RadiusOutlierRemoval"; } diff --git a/filters/include/pcl/filters/statistical_outlier_removal.h b/filters/include/pcl/filters/statistical_outlier_removal.h index f50a04a00d5..52c544657d7 100644 --- a/filters/include/pcl/filters/statistical_outlier_removal.h +++ b/filters/include/pcl/filters/statistical_outlier_removal.h @@ -216,7 +216,7 @@ namespace pcl /** \brief Empty constructor. */ StatisticalOutlierRemoval (bool extract_removed_indices = false) : FilterIndices::FilterIndices (extract_removed_indices), mean_k_ (2), - std_mul_ (0.0), tree_ () + std_mul_ (0.0) { filter_name_ = "StatisticalOutlierRemoval"; } diff --git a/filters/include/pcl/filters/voxel_grid.h b/filters/include/pcl/filters/voxel_grid.h index 7a19d59e24a..ba5b58de0b3 100644 --- a/filters/include/pcl/filters/voxel_grid.h +++ b/filters/include/pcl/filters/voxel_grid.h @@ -197,7 +197,6 @@ namespace pcl inverse_leaf_size_ (Eigen::Array4f::Zero ()), downsample_all_data_ (true), save_leaf_layout_ (false), - leaf_layout_ (), min_b_ (Eigen::Vector4i::Zero ()), max_b_ (Eigen::Vector4i::Zero ()), div_b_ (Eigen::Vector4i::Zero ()), @@ -524,7 +523,6 @@ namespace pcl inverse_leaf_size_ (Eigen::Array4f::Zero ()), downsample_all_data_ (true), save_leaf_layout_ (false), - leaf_layout_ (), min_b_ (Eigen::Vector4i::Zero ()), max_b_ (Eigen::Vector4i::Zero ()), div_b_ (Eigen::Vector4i::Zero ()), diff --git a/filters/include/pcl/filters/voxel_grid_covariance.h b/filters/include/pcl/filters/voxel_grid_covariance.h index 8ae71043005..75d4e6b2a9d 100644 --- a/filters/include/pcl/filters/voxel_grid_covariance.h +++ b/filters/include/pcl/filters/voxel_grid_covariance.h @@ -97,7 +97,6 @@ namespace pcl Leaf () : nr_points (0), mean_ (Eigen::Vector3d::Zero ()), - centroid (), cov_ (Eigen::Matrix3d::Identity ()), icov_ (Eigen::Matrix3d::Zero ()), evecs_ (Eigen::Matrix3d::Identity ()), @@ -203,7 +202,6 @@ namespace pcl min_covar_eigvalue_mult_ (0.01), leaves_ (), voxel_centroids_ (), - voxel_centroids_leaf_indices_ (), kdtree_ () { downsample_all_data_ = false; diff --git a/geometry/include/pcl/geometry/mesh_base.h b/geometry/include/pcl/geometry/mesh_base.h index 096287ade1e..972a9a393c5 100644 --- a/geometry/include/pcl/geometry/mesh_base.h +++ b/geometry/include/pcl/geometry/mesh_base.h @@ -153,17 +153,7 @@ namespace pcl : vertex_data_cloud_ (), half_edge_data_cloud_ (), edge_data_cloud_ (), - face_data_cloud_ (), - vertices_ (), - half_edges_ (), - faces_ (), - inner_he_ (), - free_he_ (), - is_new_ (), - make_adjacent_ (), - is_boundary_ (), - delete_faces_vertex_ (), - delete_faces_face_ () + face_data_cloud_ () { } diff --git a/geometry/include/pcl/geometry/planar_polygon.h b/geometry/include/pcl/geometry/planar_polygon.h index 8f7246fd2c2..f1c59cbc2b4 100644 --- a/geometry/include/pcl/geometry/planar_polygon.h +++ b/geometry/include/pcl/geometry/planar_polygon.h @@ -56,7 +56,7 @@ namespace pcl typedef boost::shared_ptr > ConstPtr; /** \brief Empty constructor for PlanarPolygon */ - PlanarPolygon () : contour_ (), coefficients_ () + PlanarPolygon () : contour_ () {} /** \brief Constructor for PlanarPolygon diff --git a/io/include/pcl/compression/color_coding.h b/io/include/pcl/compression/color_coding.h index 45d8dd03430..ea2dccd5c2f 100644 --- a/io/include/pcl/compression/color_coding.h +++ b/io/include/pcl/compression/color_coding.h @@ -72,8 +72,7 @@ namespace pcl * * */ ColorCoding () : - output_ (), pointAvgColorDataVector_ (), pointAvgColorDataVector_Iterator_ (), - pointDiffColorDataVector_ (), pointDiffColorDataVector_Iterator_ (), colorBitReduction_ (0) + output_ (), colorBitReduction_ (0) { } diff --git a/io/include/pcl/compression/entropy_range_coder.h b/io/include/pcl/compression/entropy_range_coder.h index 1f3c8aa3979..40aada29d9f 100644 --- a/io/include/pcl/compression/entropy_range_coder.h +++ b/io/include/pcl/compression/entropy_range_coder.h @@ -70,7 +70,7 @@ namespace pcl public: /** \brief Empty constructor. */ - AdaptiveRangeCoder () : outputCharVector_ () + AdaptiveRangeCoder () { } @@ -119,7 +119,7 @@ namespace pcl public: /** \brief Constructor. */ StaticRangeCoder () : - cFreqTable_ (65537), outputCharVector_ () + cFreqTable_ (65537) { } diff --git a/io/include/pcl/compression/octree_pointcloud_compression.h b/io/include/pcl/compression/octree_pointcloud_compression.h index 3ea07e1eaf5..1d9f79800d7 100644 --- a/io/include/pcl/compression/octree_pointcloud_compression.h +++ b/io/include/pcl/compression/octree_pointcloud_compression.h @@ -108,13 +108,8 @@ namespace pcl const unsigned char colorBitResolution_arg = 6) : OctreePointCloud (octreeResolution_arg), output_ (PointCloudPtr ()), - binary_tree_data_vector_ (), - binary_color_tree_vector_ (), - point_count_data_vector_ (), - point_count_data_vector_iterator_ (), color_coder_ (), point_coder_ (), - entropy_coder_ (), do_voxel_grid_enDecoding_ (doVoxelGridDownDownSampling_arg), i_frame_rate_ (iFrameRate_arg), i_frame_counter_ (0), frame_ID_ (0), point_count_ (0), i_frame_ (true), do_color_encoding_ (doColorEncoding_arg), cloud_with_color_ (false), data_with_color_ (false), diff --git a/io/include/pcl/compression/point_coding.h b/io/include/pcl/compression/point_coding.h index 3183578a973..e947e9b6e34 100644 --- a/io/include/pcl/compression/point_coding.h +++ b/io/include/pcl/compression/point_coding.h @@ -63,7 +63,7 @@ namespace pcl public: /** \brief Constructor. */ PointCoding () : - output_ (), pointDiffDataVector_ (), pointDiffDataVectorIterator_ (), + output_ (), pointCompressionResolution_ (0.001f) // 1mm { } diff --git a/io/include/pcl/io/grabber.h b/io/include/pcl/io/grabber.h index 3911a1068c7..6a24bb50aaa 100644 --- a/io/include/pcl/io/grabber.h +++ b/io/include/pcl/io/grabber.h @@ -59,7 +59,7 @@ namespace pcl public: /** \brief Constructor. */ - Grabber () : signals_ (), connections_ (), shared_connections_ () {} + Grabber () {} /** \brief virtual destructor. */ virtual inline ~Grabber () throw (); diff --git a/io/include/pcl/io/image_grabber.h b/io/include/pcl/io/image_grabber.h index d84449d3787..4b08a34336c 100644 --- a/io/include/pcl/io/image_grabber.h +++ b/io/include/pcl/io/image_grabber.h @@ -75,7 +75,7 @@ namespace pcl /** \brief Copy constructor. * \param[in] src the Image Grabber base object to copy into this */ - ImageGrabberBase (const ImageGrabberBase &src) : Grabber (), impl_ () + ImageGrabberBase (const ImageGrabberBase &src) : impl_ () { *this = src; } diff --git a/io/include/pcl/io/impl/synchronized_queue.hpp b/io/include/pcl/io/impl/synchronized_queue.hpp index bb7c10632da..499e88f3d6e 100644 --- a/io/include/pcl/io/impl/synchronized_queue.hpp +++ b/io/include/pcl/io/impl/synchronized_queue.hpp @@ -53,7 +53,7 @@ namespace pcl public: SynchronizedQueue () : - queue_(), mutex_(), cond_(), request_to_end_(false), enqueue_data_(true) { } + queue_(), request_to_end_(false), enqueue_data_(true) { } void enqueue (const T& data) diff --git a/io/include/pcl/io/lzf_image_io.h b/io/include/pcl/io/lzf_image_io.h index 09b25e7fe24..34bed4d9ba7 100644 --- a/io/include/pcl/io/lzf_image_io.h +++ b/io/include/pcl/io/lzf_image_io.h @@ -190,8 +190,7 @@ namespace pcl /** Empty constructor */ LZFDepth16ImageReader () - : LZFImageReader () - , z_multiplication_factor_ (0.001) // Set default multiplication factor + : z_multiplication_factor_ (0.001) // Set default multiplication factor {} /** Empty destructor */ @@ -243,7 +242,7 @@ namespace pcl using LZFImageReader::readParameters; /** Empty constructor */ - LZFRGB24ImageReader () : LZFImageReader () {} + LZFRGB24ImageReader () {} /** Empty destructor */ ~LZFRGB24ImageReader () {} @@ -290,7 +289,7 @@ namespace pcl using LZFRGB24ImageReader::readParameters; /** Empty constructor */ - LZFYUV422ImageReader () : LZFRGB24ImageReader () {} + LZFYUV422ImageReader () {} /** Empty destructor */ ~LZFYUV422ImageReader () {} @@ -328,7 +327,7 @@ namespace pcl using LZFRGB24ImageReader::readParameters; /** Empty constructor */ - LZFBayer8ImageReader () : LZFRGB24ImageReader () {} + LZFBayer8ImageReader () {} /** Empty destructor */ ~LZFBayer8ImageReader () {} @@ -482,8 +481,7 @@ namespace pcl public: /** Empty constructor */ LZFDepth16ImageWriter () - : LZFImageWriter () - , z_multiplication_factor_ (0.001) // Set default multiplication factor + : z_multiplication_factor_ (0.001) // Set default multiplication factor {} /** Empty destructor */ @@ -538,7 +536,7 @@ namespace pcl { public: /** Empty constructor */ - LZFRGB24ImageWriter () : LZFImageWriter () {} + LZFRGB24ImageWriter () {} /** Empty destructor */ ~LZFRGB24ImageWriter () {} @@ -580,7 +578,7 @@ namespace pcl { public: /** Empty constructor */ - LZFYUV422ImageWriter () : LZFRGB24ImageWriter () {} + LZFYUV422ImageWriter () {} /** Empty destructor */ ~LZFYUV422ImageWriter () {} @@ -611,7 +609,7 @@ namespace pcl { public: /** Empty constructor */ - LZFBayer8ImageWriter () : LZFRGB24ImageWriter () {} + LZFBayer8ImageWriter () {} /** Empty destructor */ ~LZFBayer8ImageWriter () {} diff --git a/io/include/pcl/io/openni2/openni2_frame_listener.h b/io/include/pcl/io/openni2/openni2_frame_listener.h index 0b08912054d..2e7a998578b 100644 --- a/io/include/pcl/io/openni2/openni2_frame_listener.h +++ b/io/include/pcl/io/openni2/openni2_frame_listener.h @@ -57,7 +57,7 @@ namespace pcl public: OpenNI2FrameListener () - : callback_() {} + {} OpenNI2FrameListener (StreamCallbackFunction cb) : callback_(cb) {} diff --git a/io/include/pcl/io/pcd_grabber.h b/io/include/pcl/io/pcd_grabber.h index 8b914e6bd27..6de322b1bda 100644 --- a/io/include/pcl/io/pcd_grabber.h +++ b/io/include/pcl/io/pcd_grabber.h @@ -78,7 +78,7 @@ namespace pcl /** \brief Copy constructor. * \param[in] src the PCD Grabber base object to copy into this */ - PCDGrabberBase (const PCDGrabberBase &src) : Grabber (), impl_ () + PCDGrabberBase (const PCDGrabberBase &src) : impl_ () { *this = src; } diff --git a/io/include/pcl/io/pcd_io.h b/io/include/pcl/io/pcd_io.h index 8b6dfc6fdc8..64992cff4c7 100644 --- a/io/include/pcl/io/pcd_io.h +++ b/io/include/pcl/io/pcd_io.h @@ -52,7 +52,7 @@ namespace pcl { public: /** Empty constructor */ - PCDReader () : FileReader () {} + PCDReader () {} /** Empty destructor */ ~PCDReader () {} @@ -294,7 +294,7 @@ namespace pcl class PCL_EXPORTS PCDWriter : public FileWriter { public: - PCDWriter() : FileWriter(), map_synchronization_(false) {} + PCDWriter() : map_synchronization_(false) {} ~PCDWriter() {} /** \brief Set whether mmap() synchornization via msync() is desired before munmap() calls. diff --git a/io/include/pcl/io/ply/ply_parser.h b/io/include/pcl/io/ply/ply_parser.h index ea06d63fb69..14cafa581ec 100644 --- a/io/include/pcl/io/ply/ply_parser.h +++ b/io/include/pcl/io/ply/ply_parser.h @@ -299,7 +299,6 @@ namespace pcl enum flags { }; ply_parser () : - comment_callback_ (), obj_info_callback_ (), end_header_callback_ (), line_number_ (0), current_element_ () {} @@ -376,7 +375,6 @@ namespace pcl , count (count) , begin_element_callback (begin_element_callback) , end_element_callback (end_element_callback) - , properties () {} std::string name; std::size_t count; diff --git a/io/include/pcl/io/ply_io.h b/io/include/pcl/io/ply_io.h index c19bb7701e9..3307e878d2c 100644 --- a/io/include/pcl/io/ply_io.h +++ b/io/include/pcl/io/ply_io.h @@ -83,9 +83,7 @@ namespace pcl }; PLYReader () - : FileReader () - , parser_ () - , origin_ (Eigen::Vector4f::Zero ()) + : origin_ (Eigen::Vector4f::Zero ()) , orientation_ (Eigen::Matrix3f::Zero ()) , cloud_ () , vertex_count_ (0) @@ -99,9 +97,7 @@ namespace pcl {} PLYReader (const PLYReader &p) - : FileReader () - , parser_ () - , origin_ (Eigen::Vector4f::Zero ()) + : origin_ (Eigen::Vector4f::Zero ()) , orientation_ (Eigen::Matrix3f::Zero ()) , cloud_ () , vertex_count_ (0) @@ -548,7 +544,7 @@ namespace pcl { public: ///Constructor - PLYWriter () : FileWriter () {}; + PLYWriter () {}; ///Destructor ~PLYWriter () {}; diff --git a/io/src/hdl_grabber.cpp b/io/src/hdl_grabber.cpp index c3d906bf57e..9528d65240a 100644 --- a/io/src/hdl_grabber.cpp +++ b/io/src/hdl_grabber.cpp @@ -73,8 +73,6 @@ pcl::HDLGrabber::HDLGrabber (const std::string& correctionsFile, scan_xyz_signal_ (), scan_xyzrgba_signal_ (), scan_xyzi_signal_ (), - hdl_data_ (), - udp_listener_endpoint_ (), source_address_filter_ (), source_port_filter_ (443), hdl_read_socket_service_ (), @@ -105,13 +103,11 @@ pcl::HDLGrabber::HDLGrabber (const boost::asio::ip::address& ipAddress, scan_xyz_signal_ (), scan_xyzrgba_signal_ (), scan_xyzi_signal_ (), - hdl_data_ (), udp_listener_endpoint_ (ipAddress, port), source_address_filter_ (), source_port_filter_ (443), hdl_read_socket_service_ (), hdl_read_socket_ (nullptr), - pcap_file_name_ (), queue_consumer_thread_ (nullptr), hdl_read_packet_thread_ (nullptr), min_distance_threshold_ (0.0), diff --git a/io/src/image_grabber.cpp b/io/src/image_grabber.cpp index 457548e9bee..ebd6fd87ef8 100644 --- a/io/src/image_grabber.cpp +++ b/io/src/image_grabber.cpp @@ -179,12 +179,7 @@ pcl::ImageGrabberBase::ImageGrabberImpl::ImageGrabberImpl (pcl::ImageGrabberBase , frames_per_second_ (frames_per_second) , repeat_ (repeat) , running_ (false) - , depth_image_files_ () - , rgb_image_files_ () , time_trigger_ (1.0 / static_cast (std::max (frames_per_second, 0.001f)), boost::bind (&ImageGrabberImpl::trigger, this)) - , next_cloud_ () - , origin_ () - , orientation_ () , valid_ (false) , pclzf_mode_(pclzf_mode) , depth_image_units_ (1E-3f) @@ -216,12 +211,7 @@ pcl::ImageGrabberBase::ImageGrabberImpl::ImageGrabberImpl (pcl::ImageGrabberBase , frames_per_second_ (frames_per_second) , repeat_ (repeat) , running_ (false) - , depth_image_files_ () - , rgb_image_files_ () , time_trigger_ (1.0 / static_cast (std::max (frames_per_second, 0.001f)), boost::bind (&ImageGrabberImpl::trigger, this)) - , next_cloud_ () - , origin_ () - , orientation_ () , valid_ (false) , pclzf_mode_ (false) , depth_image_units_ (1E-3f) @@ -245,12 +235,7 @@ pcl::ImageGrabberBase::ImageGrabberImpl::ImageGrabberImpl (pcl::ImageGrabberBase , frames_per_second_ (frames_per_second) , repeat_ (repeat) , running_ (false) - , depth_image_files_ () - , rgb_image_files_ () , time_trigger_ (1.0 / static_cast (std::max (frames_per_second, 0.001f)), boost::bind (&ImageGrabberImpl::trigger, this)) - , next_cloud_ () - , origin_ () - , orientation_ () , valid_ (false) , pclzf_mode_ (false) , depth_image_units_ (1E-3f) diff --git a/io/src/lzf_image_io.cpp b/io/src/lzf_image_io.cpp index 543a2e636c5..e1bde4e746e 100644 --- a/io/src/lzf_image_io.cpp +++ b/io/src/lzf_image_io.cpp @@ -349,7 +349,6 @@ pcl::io::LZFBayer8ImageWriter::write (const char *data, pcl::io::LZFImageReader::LZFImageReader () : width_ () , height_ () - , image_type_identifier_ () , parameters_ () { } diff --git a/io/src/oni_grabber.cpp b/io/src/oni_grabber.cpp index ae7398997a9..bfdd97afe83 100644 --- a/io/src/oni_grabber.cpp +++ b/io/src/oni_grabber.cpp @@ -67,10 +67,7 @@ namespace pcl ////////////////////////////////////////////////////////////////////////////////////////////////////////////////// ONIGrabber::ONIGrabber (const std::string& file_name, bool repeat, bool stream) - : rgb_sync_ () - , ir_sync_ () - , device_ () - , rgb_frame_id_ ("/openni_rgb_optical_frame") + : rgb_frame_id_ ("/openni_rgb_optical_frame") , depth_frame_id_ ("/openni_depth_optical_frame") , running_ (false) , image_width_ () diff --git a/io/src/openni2/openni2_device.cpp b/io/src/openni2/openni2_device.cpp index 2a916916b90..abb0a033000 100644 --- a/io/src/openni2/openni2_device.cpp +++ b/io/src/openni2/openni2_device.cpp @@ -54,7 +54,6 @@ using std::vector; typedef boost::chrono::high_resolution_clock hr_clock; pcl::io::openni2::OpenNI2Device::OpenNI2Device (const std::string& device_URI) : - openni_device_(), ir_video_started_(false), color_video_started_(false), depth_video_started_(false) diff --git a/io/src/openni2/openni2_device_manager.cpp b/io/src/openni2/openni2_device_manager.cpp index d6a12e7f0a5..f0c8f9a700f 100644 --- a/io/src/openni2/openni2_device_manager.cpp +++ b/io/src/openni2/openni2_device_manager.cpp @@ -67,9 +67,6 @@ namespace pcl { public: OpenNI2DeviceListener () - : openni::OpenNI::DeviceConnectedListener () - , openni::OpenNI::DeviceDisconnectedListener () - , openni::OpenNI::DeviceStateChangedListener () { openni::OpenNI::addDeviceConnectedListener (this); openni::OpenNI::addDeviceDisconnectedListener (this); diff --git a/io/src/openni2_grabber.cpp b/io/src/openni2_grabber.cpp index 88dd63aa554..d1e63365ae2 100644 --- a/io/src/openni2_grabber.cpp +++ b/io/src/openni2_grabber.cpp @@ -75,11 +75,6 @@ pcl::io::OpenNI2Grabber::OpenNI2Grabber (const std::string& device_id, const Mod : color_resize_buffer_(0) , depth_resize_buffer_(0) , ir_resize_buffer_(0) - , rgb_sync_ () - , ir_sync_ () - , device_ () - , rgb_frame_id_ () - , depth_frame_id_ () , image_width_ () , image_height_ () , depth_width_ () @@ -91,7 +86,7 @@ pcl::io::OpenNI2Grabber::OpenNI2Grabber (const std::string& device_id, const Mod , image_signal_ (), depth_image_signal_ (), ir_image_signal_ (), image_depth_image_signal_ () , ir_depth_image_signal_ (), point_cloud_signal_ (), point_cloud_i_signal_ () , point_cloud_rgb_signal_ (), point_cloud_rgba_signal_ () - , config2oni_map_ (), depth_callback_handle_ (), image_callback_handle_ (), ir_callback_handle_ () + , depth_callback_handle_ (), image_callback_handle_ (), ir_callback_handle_ () , running_ (false) , rgb_parameters_(std::numeric_limits::quiet_NaN () ) , depth_parameters_(std::numeric_limits::quiet_NaN () ) diff --git a/io/src/openni_camera/openni_device.cpp b/io/src/openni_camera/openni_device.cpp index 9eb1cbf4327..b2546f1be80 100644 --- a/io/src/openni_camera/openni_device.cpp +++ b/io/src/openni_camera/openni_device.cpp @@ -67,16 +67,8 @@ openni_wrapper::OpenNIDevice::OpenNIDevice ( const xn::NodeInfo& ir_node #endif ) - : image_callback_ (), - depth_callback_ (), - ir_callback_ (), - available_image_modes_ (), - available_depth_modes_ (), - context_ (context), + : context_ (context), device_node_info_ (device_node), - depth_generator_ (), - image_generator_ (), - ir_generator_ (), depth_callback_handle_ (), image_callback_handle_ (), ir_callback_handle_ (), @@ -89,10 +81,7 @@ openni_wrapper::OpenNIDevice::OpenNIDevice ( image_callback_handle_counter_ (), depth_callback_handle_counter_ (), ir_callback_handle_counter_ (), - quit_ (), - image_mutex_ (), depth_mutex_ (), ir_mutex_ (), - image_condition_ (), depth_condition_ (), ir_condition_ (), - image_thread_ (), depth_thread_ (), ir_thread_ () + quit_ () { // workaround for MAC from Alex Ichim #ifdef __APPLE__ @@ -183,16 +172,8 @@ openni_wrapper::OpenNIDevice::OpenNIDevice (xn::Context& context, const xn::Node const xn::NodeInfo& ir_node #endif ) - : image_callback_ (), - depth_callback_ (), - ir_callback_ (), - available_image_modes_ (), - available_depth_modes_ (), - context_ (context), + : context_ (context), device_node_info_ (device_node), - depth_generator_ (), - image_generator_ (), - ir_generator_ (), depth_callback_handle_ (), image_callback_handle_ (), ir_callback_handle_ (), @@ -205,10 +186,7 @@ openni_wrapper::OpenNIDevice::OpenNIDevice (xn::Context& context, const xn::Node image_callback_handle_counter_ (), depth_callback_handle_counter_ (), ir_callback_handle_counter_ (), - quit_ (), - image_mutex_ (), depth_mutex_ (), ir_mutex_ (), - image_condition_ (), depth_condition_ (), ir_condition_ (), - image_thread_ (), depth_thread_ (), ir_thread_ () + quit_ () { // workaround for MAC from Alex Ichim #ifdef __APPLE__ @@ -275,16 +253,8 @@ openni_wrapper::OpenNIDevice::OpenNIDevice (xn::Context& context, const xn::Node ////////////////////////////////////////////////////////////////////////////////////////////////////////////////// // For ONI Player devices openni_wrapper::OpenNIDevice::OpenNIDevice (xn::Context& context) - : image_callback_ (), - depth_callback_ (), - ir_callback_ (), - available_image_modes_ (), - available_depth_modes_ (), - context_ (context), + : context_ (context), device_node_info_ (nullptr), - depth_generator_ (), - image_generator_ (), - ir_generator_ (), depth_callback_handle_ (), image_callback_handle_ (), ir_callback_handle_ (), @@ -297,10 +267,7 @@ openni_wrapper::OpenNIDevice::OpenNIDevice (xn::Context& context) image_callback_handle_counter_ (), depth_callback_handle_counter_ (), ir_callback_handle_counter_ (), - quit_ (), - image_mutex_ (), depth_mutex_ (), ir_mutex_ (), - image_condition_ (), depth_condition_ (), ir_condition_ (), - image_thread_ (), depth_thread_ (), ir_thread_ () + quit_ () { } diff --git a/io/src/openni_camera/openni_driver.cpp b/io/src/openni_camera/openni_driver.cpp index 880c0b31005..0bb37916528 100644 --- a/io/src/openni_camera/openni_driver.cpp +++ b/io/src/openni_camera/openni_driver.cpp @@ -63,11 +63,6 @@ ////////////////////////////////////////////////////////////////////////////////////////////////////////////////////// openni_wrapper::OpenNIDriver::OpenNIDriver () - : device_context_ () - , context_ () - , bus_map_ () - , serial_map_ () - , connection_string_map_ () { // Initialize the Engine XnStatus status = context_.Init (); @@ -550,7 +545,6 @@ openni_wrapper::OpenNIDriver::DeviceContext::DeviceContext (const xn::NodeInfo& , image_node (image) , depth_node (depth) , ir_node (ir) -, device () { } @@ -560,7 +554,6 @@ openni_wrapper::OpenNIDriver::DeviceContext::DeviceContext (const xn::NodeInfo& , image_node (static_cast (nullptr)) , depth_node (static_cast (nullptr)) , ir_node (static_cast (nullptr)) -, device () { } diff --git a/io/src/openni_grabber.cpp b/io/src/openni_grabber.cpp index b7ab48d8711..b2a0bf0c4a7 100644 --- a/io/src/openni_grabber.cpp +++ b/io/src/openni_grabber.cpp @@ -53,12 +53,7 @@ using namespace std::chrono_literals; ////////////////////////////////////////////////////////////////////////////////////////////////////////////////// pcl::OpenNIGrabber::OpenNIGrabber (const std::string& device_id, const Mode& depth_mode, const Mode& image_mode) - : rgb_sync_ () - , ir_sync_ () - , device_ () - , rgb_frame_id_ () - , depth_frame_id_ () - , image_width_ () + : image_width_ () , image_height_ () , depth_width_ () , depth_height_ () @@ -69,7 +64,7 @@ pcl::OpenNIGrabber::OpenNIGrabber (const std::string& device_id, const Mode& dep , image_signal_ (), depth_image_signal_ (), ir_image_signal_ (), image_depth_image_signal_ () , ir_depth_image_signal_ (), point_cloud_signal_ (), point_cloud_i_signal_ () , point_cloud_rgb_signal_ (), point_cloud_rgba_signal_ () - , config2xn_map_ (), depth_callback_handle (), image_callback_handle (), ir_callback_handle () + , depth_callback_handle (), image_callback_handle (), ir_callback_handle () , running_ (false) , rgb_array_size_ (0) , depth_buffer_size_ (0) diff --git a/io/src/pcd_grabber.cpp b/io/src/pcd_grabber.cpp index ead6253d8e7..ea96572dd0b 100644 --- a/io/src/pcd_grabber.cpp +++ b/io/src/pcd_grabber.cpp @@ -110,17 +110,10 @@ pcl::PCDGrabberBase::PCDGrabberImpl::PCDGrabberImpl (pcl::PCDGrabberBase& grabbe , frames_per_second_ (frames_per_second) , repeat_ (repeat) , running_ (false) - , pcd_files_ () - , pcd_iterator_ () , time_trigger_ (1.0 / static_cast (std::max (frames_per_second, 0.001f)), boost::bind (&PCDGrabberImpl::trigger, this)) - , next_cloud_ () - , origin_ () - , orientation_ () - , next_file_name_ () , valid_ (false) , tar_fd_ (-1) , tar_offset_ (0) - , tar_file_ () , tar_header_ () , scraped_ (false) { @@ -136,17 +129,10 @@ pcl::PCDGrabberBase::PCDGrabberImpl::PCDGrabberImpl (pcl::PCDGrabberBase& grabbe , frames_per_second_ (frames_per_second) , repeat_ (repeat) , running_ (false) - , pcd_files_ () - , pcd_iterator_ () , time_trigger_ (1.0 / static_cast (std::max (frames_per_second, 0.001f)), boost::bind (&PCDGrabberImpl::trigger, this)) - , next_cloud_ () - , origin_ () - , orientation_ () - , next_file_name_ () , valid_ (false) , tar_fd_ (-1) , tar_offset_ (0) - , tar_file_ () , tar_header_ () , scraped_ (false) { diff --git a/io/tools/ply/ply2raw.cpp b/io/tools/ply/ply2raw.cpp index 82022f373ac..a8605a7a44b 100644 --- a/io/tools/ply/ply2raw.cpp +++ b/io/tools/ply/ply2raw.cpp @@ -65,16 +65,14 @@ class ply_to_raw_converter ostream_ (), vertex_x_ (0), vertex_y_ (0), vertex_z_ (0), face_vertex_indices_element_index_ (), face_vertex_indices_first_element_ (), - face_vertex_indices_previous_element_ (), - vertices_ () + face_vertex_indices_previous_element_ () {} ply_to_raw_converter (const ply_to_raw_converter &f) : ostream_ (), vertex_x_ (0), vertex_y_ (0), vertex_z_ (0), face_vertex_indices_element_index_ (), face_vertex_indices_first_element_ (), - face_vertex_indices_previous_element_ (), - vertices_ () + face_vertex_indices_previous_element_ () { *this = f; } diff --git a/kdtree/include/pcl/kdtree/impl/kdtree_flann.hpp b/kdtree/include/pcl/kdtree/impl/kdtree_flann.hpp index 60506742737..9ec6728751a 100644 --- a/kdtree/include/pcl/kdtree/impl/kdtree_flann.hpp +++ b/kdtree/include/pcl/kdtree/impl/kdtree_flann.hpp @@ -50,8 +50,8 @@ template pcl::KdTreeFLANN::KdTreeFLANN (bool sorted) : pcl::KdTree (sorted) - , flann_index_ (), cloud_ () - , index_mapping_ (), identity_mapping_ (false) + , flann_index_ () + , identity_mapping_ (false) , dim_ (0), total_nr_points_ (0) , param_k_ (::flann::SearchParams (-1 , epsilon_)) , param_radius_ (::flann::SearchParams (-1, epsilon_, sorted)) @@ -62,8 +62,8 @@ pcl::KdTreeFLANN::KdTreeFLANN (bool sorted) template pcl::KdTreeFLANN::KdTreeFLANN (const KdTreeFLANN &k) : pcl::KdTree (false) - , flann_index_ (), cloud_ () - , index_mapping_ (), identity_mapping_ (false) + , flann_index_ () + , identity_mapping_ (false) , dim_ (0), total_nr_points_ (0) , param_k_ (::flann::SearchParams (-1 , epsilon_)) , param_radius_ (::flann::SearchParams (-1, epsilon_, false)) diff --git a/kdtree/include/pcl/kdtree/kdtree.h b/kdtree/include/pcl/kdtree/kdtree.h index 42d87a11ded..cc398417bf2 100644 --- a/kdtree/include/pcl/kdtree/kdtree.h +++ b/kdtree/include/pcl/kdtree/kdtree.h @@ -73,7 +73,7 @@ namespace pcl /** \brief Empty constructor for KdTree. Sets some internal values to their defaults. * \param[in] sorted set to true if the application that the tree will be used for requires sorted nearest neighbor indices (default). False otherwise. */ - KdTree (bool sorted = true) : input_(), indices_(), + KdTree (bool sorted = true) : input_(), epsilon_(0.0f), min_pts_(1), sorted_(sorted), point_representation_ (new DefaultPointRepresentation) { diff --git a/keypoints/include/pcl/keypoints/agast_2d.h b/keypoints/include/pcl/keypoints/agast_2d.h index 7aad0117b53..b10c63e72d1 100644 --- a/keypoints/include/pcl/keypoints/agast_2d.h +++ b/keypoints/include/pcl/keypoints/agast_2d.h @@ -572,7 +572,6 @@ namespace pcl : threshold_ (10) , apply_non_max_suppression_ (true) , bmax_ (255) - , detector_ () , nr_max_keypoints_ (std::numeric_limits::max ()) { k_ = 1; diff --git a/keypoints/include/pcl/keypoints/keypoint.h b/keypoints/include/pcl/keypoints/keypoint.h index cd89e2276aa..8b24101329e 100644 --- a/keypoints/include/pcl/keypoints/keypoint.h +++ b/keypoints/include/pcl/keypoints/keypoint.h @@ -74,8 +74,6 @@ namespace pcl /** \brief Empty constructor. */ Keypoint () : BaseClass (), - name_ (), - search_method_ (), search_method_surface_ (), surface_ (), tree_ (), diff --git a/keypoints/include/pcl/keypoints/sift_keypoint.h b/keypoints/include/pcl/keypoints/sift_keypoint.h index b0ce427cd26..e77f58f40d0 100644 --- a/keypoints/include/pcl/keypoints/sift_keypoint.h +++ b/keypoints/include/pcl/keypoints/sift_keypoint.h @@ -110,7 +110,7 @@ namespace pcl /** \brief Empty constructor. */ SIFTKeypoint () : min_scale_ (0.0), nr_octaves_ (0), nr_scales_per_octave_ (0), min_contrast_ (-std::numeric_limits::max ()), scale_idx_ (-1), - out_fields_ (), getFieldValue_ () + getFieldValue_ () { name_ = "SIFTKeypoint"; } diff --git a/keypoints/include/pcl/keypoints/smoothed_surfaces_keypoint.h b/keypoints/include/pcl/keypoints/smoothed_surfaces_keypoint.h index 08a1c41bc18..52ab0c6543b 100644 --- a/keypoints/include/pcl/keypoints/smoothed_surfaces_keypoint.h +++ b/keypoints/include/pcl/keypoints/smoothed_surfaces_keypoint.h @@ -77,7 +77,6 @@ namespace pcl cloud_normals_ (), cloud_trees_ (), normals_ (), - scales_ (), input_scale_ (0.0f), input_index_ () { diff --git a/keypoints/include/pcl/keypoints/susan.h b/keypoints/include/pcl/keypoints/susan.h index e47f09ebc86..00339d5a31d 100644 --- a/keypoints/include/pcl/keypoints/susan.h +++ b/keypoints/include/pcl/keypoints/susan.h @@ -95,7 +95,6 @@ namespace pcl , normals_ (new pcl::PointCloud) , threads_ (0) , label_idx_ (-1) - , out_fields_ () { name_ = "SUSANKeypoint"; search_radius_ = radius; diff --git a/keypoints/src/narf_keypoint.cpp b/keypoints/src/narf_keypoint.cpp index 6406bd0e19c..d93daefc263 100644 --- a/keypoints/src/narf_keypoint.cpp +++ b/keypoints/src/narf_keypoint.cpp @@ -46,7 +46,7 @@ namespace pcl ///////////////////////////////////////////////////////////////////////// NarfKeypoint::NarfKeypoint (RangeImageBorderExtractor* range_image_border_extractor, float support_size) : - BaseClass (), interest_image_ (nullptr), interest_points_ (nullptr) + interest_image_ (nullptr), interest_points_ (nullptr) { name_ = "NarfKeypoint"; clearData (); diff --git a/ml/include/pcl/ml/svm_wrapper.h b/ml/include/pcl/ml/svm_wrapper.h index 344e16e082b..7318ecdeb12 100755 --- a/ml/include/pcl/ml/svm_wrapper.h +++ b/ml/include/pcl/ml/svm_wrapper.h @@ -176,8 +176,7 @@ namespace pcl public: /** \brief Constructor. */ SVM () : - training_set_ (), prob_ (), model_ (), scaling_ (), param_ (), - class_name_ (), line_ (nullptr), max_line_len_ (10000), labelled_training_set_ (true) + prob_ (), line_ (nullptr), max_line_len_ (10000), labelled_training_set_ (true) { } diff --git a/octree/include/pcl/octree/impl/octree2buf_base.hpp b/octree/include/pcl/octree/impl/octree2buf_base.hpp index f6922a77b96..c9c70df955e 100644 --- a/octree/include/pcl/octree/impl/octree2buf_base.hpp +++ b/octree/include/pcl/octree/impl/octree2buf_base.hpp @@ -50,7 +50,6 @@ namespace pcl branch_count_ (1), root_node_ (new BranchNode ()), depth_mask_ (0), - max_key_ (), buffer_selector_ (0), tree_dirty_flag_ (false), octree_depth_ (0), diff --git a/octree/include/pcl/octree/impl/octree_base.hpp b/octree/include/pcl/octree/impl/octree_base.hpp index 9894fd3b7ea..e6857213ed0 100644 --- a/octree/include/pcl/octree/impl/octree_base.hpp +++ b/octree/include/pcl/octree/impl/octree_base.hpp @@ -55,8 +55,7 @@ namespace pcl root_node_ (new BranchNode ()), depth_mask_ (0), octree_depth_ (0), - dynamic_depth_enabled_ (false), - max_key_ () + dynamic_depth_enabled_ (false) { } diff --git a/octree/include/pcl/octree/octree_container.h b/octree/include/pcl/octree/octree_container.h index 3f0c9543450..055af3b4ce4 100644 --- a/octree/include/pcl/octree/octree_container.h +++ b/octree/include/pcl/octree/octree_container.h @@ -133,14 +133,12 @@ namespace pcl { public: /** \brief Empty constructor. */ - OctreeContainerEmpty () : - OctreeContainerBase () + OctreeContainerEmpty () { } /** \brief Empty constructor. */ - OctreeContainerEmpty (const OctreeContainerEmpty&) : - OctreeContainerBase () + OctreeContainerEmpty (const OctreeContainerEmpty&) { } @@ -208,14 +206,14 @@ namespace pcl public: /** \brief Empty constructor. */ OctreeContainerPointIndex () : - OctreeContainerBase (), data_ () + data_ () { reset (); } /** \brief Empty constructor. */ OctreeContainerPointIndex (const OctreeContainerPointIndex& source) : - OctreeContainerBase (), data_ (source.data_) + data_ (source.data_) { } @@ -300,14 +298,13 @@ namespace pcl { public: /** \brief Empty constructor. */ - OctreeContainerPointIndices () : - OctreeContainerBase (), leafDataTVector_ () + OctreeContainerPointIndices () { } /** \brief Empty constructor. */ OctreeContainerPointIndices (const OctreeContainerPointIndices& source) : - OctreeContainerBase (), leafDataTVector_ (source.leafDataTVector_) + leafDataTVector_ (source.leafDataTVector_) { } diff --git a/octree/include/pcl/octree/octree_search.h b/octree/include/pcl/octree/octree_search.h index f4a06c3627e..a36d53fc29f 100644 --- a/octree/include/pcl/octree/octree_search.h +++ b/octree/include/pcl/octree/octree_search.h @@ -263,7 +263,7 @@ namespace pcl public: /** \brief Empty constructor */ prioBranchQueueEntry () : - node (), point_distance (0), key () + node (), point_distance (0) { } diff --git a/outofcore/src/outofcore_base_data.cpp b/outofcore/src/outofcore_base_data.cpp index 3fb8a23698a..655b2c1760c 100644 --- a/outofcore/src/outofcore_base_data.cpp +++ b/outofcore/src/outofcore_base_data.cpp @@ -53,13 +53,9 @@ namespace pcl namespace outofcore { OutofcoreOctreeBaseMetadata::OutofcoreOctreeBaseMetadata () - : metadata_filename_ () - , outofcore_version_ () - , coordinate_system_ () - , tree_name_ () + : outofcore_version_ () , point_type_ ("urp") , levels_of_depth_ () - , LOD_num_points_ () { } @@ -68,11 +64,8 @@ namespace pcl OutofcoreOctreeBaseMetadata::OutofcoreOctreeBaseMetadata (const boost::filesystem::path& metadata_filename) : metadata_filename_ (metadata_filename) , outofcore_version_ () - , coordinate_system_ () - , tree_name_ () , point_type_ ("urp") , levels_of_depth_ () - , LOD_num_points_ () { //read metadata from file and store in fields loadMetadataFromDisk (); @@ -88,8 +81,7 @@ namespace pcl //////////////////////////////////////////////////////////////////////////////// OutofcoreOctreeBaseMetadata::OutofcoreOctreeBaseMetadata (const OutofcoreOctreeBaseMetadata& orig) - : OutofcoreAbstractMetadata () - , metadata_filename_ (orig.metadata_filename_) + : metadata_filename_ (orig.metadata_filename_) , outofcore_version_ (orig.outofcore_version_) , coordinate_system_ (orig.coordinate_system_) , tree_name_ (orig.tree_name_) diff --git a/outofcore/src/outofcore_node_data.cpp b/outofcore/src/outofcore_node_data.cpp index f1ff9d69445..25384005aa9 100644 --- a/outofcore/src/outofcore_node_data.cpp +++ b/outofcore/src/outofcore_node_data.cpp @@ -54,13 +54,7 @@ namespace pcl { OutofcoreOctreeNodeMetadata::OutofcoreOctreeNodeMetadata () - : min_bb_ (), - max_bb_ (), - binary_point_filename_ (), - midpoint_xyz_ (), - directory_ (), - metadata_filename_ (), - outofcore_version_ () + : outofcore_version_ () { } diff --git a/recognition/include/pcl/recognition/cg/correspondence_grouping.h b/recognition/include/pcl/recognition/cg/correspondence_grouping.h index 74cf3d9928d..ec136598d49 100644 --- a/recognition/include/pcl/recognition/cg/correspondence_grouping.h +++ b/recognition/include/pcl/recognition/cg/correspondence_grouping.h @@ -59,7 +59,7 @@ namespace pcl typedef typename SceneCloud::ConstPtr SceneCloudConstPtr; /** \brief Empty constructor. */ - CorrespondenceGrouping () : scene_ (), model_scene_corrs_ () {} + CorrespondenceGrouping () : scene_ () {} /** \brief destructor. */ ~CorrespondenceGrouping() diff --git a/recognition/include/pcl/recognition/cg/geometric_consistency.h b/recognition/include/pcl/recognition/cg/geometric_consistency.h index 9d8393512e9..1878381fa7e 100644 --- a/recognition/include/pcl/recognition/cg/geometric_consistency.h +++ b/recognition/include/pcl/recognition/cg/geometric_consistency.h @@ -64,7 +64,6 @@ namespace pcl GeometricConsistencyGrouping () : gc_threshold_ (3) , gc_size_ (1.0) - , found_transformations_ () {} diff --git a/recognition/include/pcl/recognition/cg/hough_3d.h b/recognition/include/pcl/recognition/cg/hough_3d.h index afe4af649cb..a4aeb930c38 100644 --- a/recognition/include/pcl/recognition/cg/hough_3d.h +++ b/recognition/include/pcl/recognition/cg/hough_3d.h @@ -165,15 +165,12 @@ namespace pcl : input_rf_ () , scene_rf_ () , needs_training_ (true) - , model_votes_ () - , hough_threshold_ (-1) + ,hough_threshold_ (-1) , hough_bin_size_ (1.0) , use_interpolation_ (true) , use_distance_weight_ (false) , local_rf_normals_search_radius_ (0.0f) , local_rf_search_radius_ (0.0f) - , hough_space_ () - , found_transformations_ () , hough_space_initialized_ (false) {} diff --git a/recognition/include/pcl/recognition/color_gradient_modality.h b/recognition/include/pcl/recognition/color_gradient_modality.h index c2515955870..0a2228ce1af 100644 --- a/recognition/include/pcl/recognition/color_gradient_modality.h +++ b/recognition/include/pcl/recognition/color_gradient_modality.h @@ -279,11 +279,7 @@ ColorGradientModality () , feature_selection_method_ (DISTANCE_MAGNITUDE_SCORE) , gradient_magnitude_threshold_ (10.0f) , gradient_magnitude_threshold_feature_extraction_ (55.0f) - , color_gradients_ () , spreading_size_ (8) - , quantized_color_gradients_ () - , filtered_quantized_color_gradients_ () - , spreaded_filtered_quantized_color_gradients_ () { } diff --git a/recognition/include/pcl/recognition/impl/implicit_shape_model.hpp b/recognition/include/pcl/recognition/impl/implicit_shape_model.hpp index 67a71999738..43f1d8c5257 100644 --- a/recognition/include/pcl/recognition/impl/implicit_shape_model.hpp +++ b/recognition/include/pcl/recognition/impl/implicit_shape_model.hpp @@ -50,7 +50,6 @@ pcl::features::ISMVoteList::ISMVoteList () : tree_is_valid_ (false), votes_origins_ (new pcl::PointCloud ()), votes_class_ (0), - tree_ (), k_ind_ (0), k_sqr_dist_ (0) { @@ -301,8 +300,6 @@ pcl::features::ISMModel::ISMModel () : learned_weights_ (0), classes_ (0), sigmas_ (0), - directions_to_center_ (), - clusters_centers_ (), clusters_ (0), number_of_classes_ (0), number_of_visual_words_ (0), diff --git a/recognition/include/pcl/recognition/linemod.h b/recognition/include/pcl/recognition/linemod.h index d7ad6ac0f80..ef09ee11957 100644 --- a/recognition/include/pcl/recognition/linemod.h +++ b/recognition/include/pcl/recognition/linemod.h @@ -55,7 +55,7 @@ namespace pcl { public: /** \brief Constructor. */ - EnergyMaps () : width_ (0), height_ (0), nr_bins_ (0), maps_ () + EnergyMaps () : width_ (0), height_ (0), nr_bins_ (0) { } @@ -200,7 +200,7 @@ namespace pcl { public: /** \brief Constructor. */ - LinearizedMaps () : width_ (0), height_ (0), mem_width_ (0), mem_height_ (0), step_size_ (0), maps_ () + LinearizedMaps () : width_ (0), height_ (0), mem_width_ (0), mem_height_ (0), step_size_ (0) { } diff --git a/recognition/include/pcl/recognition/linemod/line_rgbd.h b/recognition/include/pcl/recognition/linemod/line_rgbd.h index 1ef8dbaff86..e34bca30f19 100644 --- a/recognition/include/pcl/recognition/linemod/line_rgbd.h +++ b/recognition/include/pcl/recognition/linemod/line_rgbd.h @@ -77,7 +77,7 @@ namespace pcl struct Detection { /** \brief Constructor. */ - Detection () : template_id (0), object_id (0), detection_id (0), response (0.0f), bounding_box () {} + Detection () : template_id (0), object_id (0), detection_id (0), response (0.0f) {} /** \brief The ID of the template. */ size_t template_id; @@ -96,14 +96,10 @@ namespace pcl /** \brief Constructor */ LineRGBD () : intersection_volume_threshold_ (1.0f) - , linemod_ () , color_gradient_mod_ () , surface_normal_mod_ () , cloud_xyz_ () , cloud_rgb_ () - , template_point_clouds_ () - , bounding_boxes_ () - , object_ids_ () , detections_ () { } diff --git a/recognition/include/pcl/recognition/sparse_quantized_multi_mod_template.h b/recognition/include/pcl/recognition/sparse_quantized_multi_mod_template.h index d9ea979517c..d1446299be2 100644 --- a/recognition/include/pcl/recognition/sparse_quantized_multi_mod_template.h +++ b/recognition/include/pcl/recognition/sparse_quantized_multi_mod_template.h @@ -108,7 +108,7 @@ namespace pcl struct SparseQuantizedMultiModTemplate { /** \brief Constructor. */ - SparseQuantizedMultiModTemplate () : features (), region () {} + SparseQuantizedMultiModTemplate () {} /** \brief The storage for the multi-modality features. */ std::vector features; diff --git a/recognition/include/pcl/recognition/surface_normal_modality.h b/recognition/include/pcl/recognition/surface_normal_modality.h index 3298fec1821..98349b0d208 100644 --- a/recognition/include/pcl/recognition/surface_normal_modality.h +++ b/recognition/include/pcl/recognition/surface_normal_modality.h @@ -55,7 +55,7 @@ namespace pcl { public: /** \brief Constructor. */ - inline LINEMOD_OrientationMap () : width_ (0), height_ (0), map_ () {} + inline LINEMOD_OrientationMap () : width_ (0), height_ (0) {} /** \brief Destructor. */ inline ~LINEMOD_OrientationMap () {} @@ -297,7 +297,7 @@ namespace pcl struct Candidate { /** \brief Constructor. */ - Candidate () : normal (), distance (0.0f), bin_index (0), x (0), y (0) {} + Candidate () : distance (0.0f), bin_index (0), x (0), y (0) {} /** \brief Normal. */ Normal normal; @@ -490,13 +490,7 @@ SurfaceNormalModality () : variable_feature_nr_ (false) , feature_distance_threshold_ (2.0f) , min_distance_to_border_ (2.0f) - , normal_lookup_ () , spreading_size_ (8) - , surface_normals_ () - , quantized_surface_normals_ () - , filtered_quantized_surface_normals_ () - , spreaded_quantized_surface_normals_ () - , surface_normal_orientations_ () { } diff --git a/recognition/src/dotmod.cpp b/recognition/src/dotmod.cpp index c2a6285c54b..9c45f4c0134 100644 --- a/recognition/src/dotmod.cpp +++ b/recognition/src/dotmod.cpp @@ -45,8 +45,7 @@ pcl::DOTMOD:: DOTMOD(size_t template_width, size_t template_height) : template_width_ (template_width), - template_height_ (template_height), - templates_ () + template_height_ (template_height) { } diff --git a/recognition/src/linemod.cpp b/recognition/src/linemod.cpp index c9bbed8bfbf..1d5be7d0e3d 100644 --- a/recognition/src/linemod.cpp +++ b/recognition/src/linemod.cpp @@ -52,7 +52,6 @@ pcl::LINEMOD::LINEMOD () : template_threshold_ (0.75f) , use_non_max_suppression_ (false) , average_detections_ (false) - , templates_ () { } diff --git a/recognition/src/mask_map.cpp b/recognition/src/mask_map.cpp index 2bdde70501d..5eb1d5588e1 100644 --- a/recognition/src/mask_map.cpp +++ b/recognition/src/mask_map.cpp @@ -47,7 +47,7 @@ pcl::MaskMap::MaskMap () ////////////////////////////////////////////////////////////////////////////////////////////// pcl::MaskMap::MaskMap (const size_t width, const size_t height) - : data_ (), width_ (width), height_ (height) + : width_ (width), height_ (height) { data_.resize (width*height); } diff --git a/registration/include/pcl/registration/correspondence_estimation.h b/registration/include/pcl/registration/correspondence_estimation.h index 892113f6b3d..b450e375bc3 100644 --- a/registration/include/pcl/registration/correspondence_estimation.h +++ b/registration/include/pcl/registration/correspondence_estimation.h @@ -93,10 +93,8 @@ namespace pcl , tree_ (new pcl::search::KdTree) , tree_reciprocal_ (new pcl::search::KdTree) , target_ () - , target_indices_ () , point_representation_ () , input_transformed_ () - , input_fields_ () , target_cloud_updated_ (true) , source_cloud_updated_ (true) , force_no_recompute_ (false) diff --git a/registration/include/pcl/registration/correspondence_rejection.h b/registration/include/pcl/registration/correspondence_rejection.h index d0559caf433..19a02d0ec34 100644 --- a/registration/include/pcl/registration/correspondence_rejection.h +++ b/registration/include/pcl/registration/correspondence_rejection.h @@ -63,8 +63,6 @@ namespace pcl /** \brief Empty constructor. */ CorrespondenceRejector () - : rejection_name_ () - , input_correspondences_ () {} /** \brief Empty destructor. */ diff --git a/registration/include/pcl/registration/correspondence_rejection_distance.h b/registration/include/pcl/registration/correspondence_rejection_distance.h index c3db775d0d6..6408d9ba5d6 100644 --- a/registration/include/pcl/registration/correspondence_rejection_distance.h +++ b/registration/include/pcl/registration/correspondence_rejection_distance.h @@ -69,8 +69,7 @@ namespace pcl typedef boost::shared_ptr ConstPtr; /** \brief Empty constructor. */ - CorrespondenceRejectorDistance () : max_distance_(std::numeric_limits::max ()), - data_container_ () + CorrespondenceRejectorDistance () : max_distance_(std::numeric_limits::max ()) { rejection_name_ = "CorrespondenceRejectorDistance"; } diff --git a/registration/include/pcl/registration/correspondence_rejection_features.h b/registration/include/pcl/registration/correspondence_rejection_features.h index dc42b03b4d9..12efedb0f84 100644 --- a/registration/include/pcl/registration/correspondence_rejection_features.h +++ b/registration/include/pcl/registration/correspondence_rejection_features.h @@ -68,7 +68,7 @@ namespace pcl typedef boost::shared_ptr ConstPtr; /** \brief Empty constructor. */ - CorrespondenceRejectorFeatures () : max_distance_ (std::numeric_limits::max ()), features_map_ () + CorrespondenceRejectorFeatures () : max_distance_ (std::numeric_limits::max ()) { rejection_name_ = "CorrespondenceRejectorFeatures"; } diff --git a/registration/include/pcl/registration/correspondence_rejection_median_distance.h b/registration/include/pcl/registration/correspondence_rejection_median_distance.h index 44f1f16ddec..76527907203 100644 --- a/registration/include/pcl/registration/correspondence_rejection_median_distance.h +++ b/registration/include/pcl/registration/correspondence_rejection_median_distance.h @@ -72,7 +72,6 @@ namespace pcl CorrespondenceRejectorMedianDistance () : median_distance_ (0) , factor_ (1.0) - , data_container_ () { rejection_name_ = "CorrespondenceRejectorMedianDistance"; } diff --git a/registration/include/pcl/registration/correspondence_rejection_organized_boundary.h b/registration/include/pcl/registration/correspondence_rejection_organized_boundary.h index e6428ae5aa4..37cedb98408 100644 --- a/registration/include/pcl/registration/correspondence_rejection_organized_boundary.h +++ b/registration/include/pcl/registration/correspondence_rejection_organized_boundary.h @@ -63,7 +63,6 @@ namespace pcl : boundary_nans_threshold_ (8) , window_size_ (5) , depth_step_threshold_ (0.025f) - , data_container_ () { } void diff --git a/registration/include/pcl/registration/correspondence_rejection_sample_consensus.h b/registration/include/pcl/registration/correspondence_rejection_sample_consensus.h index 014f90a1ce9..a9e84dfa5a5 100644 --- a/registration/include/pcl/registration/correspondence_rejection_sample_consensus.h +++ b/registration/include/pcl/registration/correspondence_rejection_sample_consensus.h @@ -79,7 +79,6 @@ namespace pcl , input_ () , input_transformed_ () , target_ () - , best_transformation_ () , refine_ (false) , save_inliers_ (false) { diff --git a/registration/include/pcl/registration/correspondence_rejection_surface_normal.h b/registration/include/pcl/registration/correspondence_rejection_surface_normal.h index ed60277fef5..cc41d1f512f 100644 --- a/registration/include/pcl/registration/correspondence_rejection_surface_normal.h +++ b/registration/include/pcl/registration/correspondence_rejection_surface_normal.h @@ -70,7 +70,6 @@ namespace pcl /** \brief Empty constructor. Sets the threshold to 1.0. */ CorrespondenceRejectorSurfaceNormal () : threshold_ (1.0) - , data_container_ () { rejection_name_ = "CorrespondenceRejectorSurfaceNormal"; } diff --git a/registration/include/pcl/registration/correspondence_rejection_var_trimmed.h b/registration/include/pcl/registration/correspondence_rejection_var_trimmed.h index 0e5ddfa2d2c..61be06cef74 100644 --- a/registration/include/pcl/registration/correspondence_rejection_var_trimmed.h +++ b/registration/include/pcl/registration/correspondence_rejection_var_trimmed.h @@ -77,8 +77,7 @@ namespace pcl factor_ (), min_ratio_ (0.05), max_ratio_ (0.95), - lambda_ (0.95), - data_container_ () + lambda_ (0.95) { rejection_name_ = "CorrespondenceRejectorVarTrimmed"; } diff --git a/registration/include/pcl/registration/elch.h b/registration/include/pcl/registration/elch.h index 26ec225f683..7a4634b838e 100644 --- a/registration/include/pcl/registration/elch.h +++ b/registration/include/pcl/registration/elch.h @@ -94,7 +94,6 @@ namespace pcl loop_start_ (0), loop_end_ (0), reg_ (new pcl::IterativeClosestPoint), - loop_transform_ (), compute_loop_ (true), vd_ () {}; diff --git a/registration/include/pcl/registration/impl/ia_kfpcs.hpp b/registration/include/pcl/registration/impl/ia_kfpcs.hpp index 27cc0b1cac8..a86702b9fb0 100644 --- a/registration/include/pcl/registration/impl/ia_kfpcs.hpp +++ b/registration/include/pcl/registration/impl/ia_kfpcs.hpp @@ -43,7 +43,6 @@ pcl::registration::KFPCSInitialAlignment ) { diff --git a/registration/include/pcl/registration/impl/ndt.hpp b/registration/include/pcl/registration/impl/ndt.hpp index 598c40dc0a4..48dd6a9f9af 100644 --- a/registration/include/pcl/registration/impl/ndt.hpp +++ b/registration/include/pcl/registration/impl/ndt.hpp @@ -51,11 +51,6 @@ pcl::NormalDistributionsTransform::NormalDistributions , gauss_d1_ () , gauss_d2_ () , trans_probability_ () - , j_ang_a_ (), j_ang_b_ (), j_ang_c_ (), j_ang_d_ (), j_ang_e_ (), j_ang_f_ (), j_ang_g_ (), j_ang_h_ () - , h_ang_a2_ (), h_ang_a3_ (), h_ang_b2_ (), h_ang_b3_ (), h_ang_c2_ (), h_ang_c3_ (), h_ang_d1_ (), h_ang_d2_ () - , h_ang_d3_ (), h_ang_e1_ (), h_ang_e2_ (), h_ang_e3_ (), h_ang_f1_ (), h_ang_f2_ (), h_ang_f3_ () - , point_gradient_ () - , point_hessian_ () { reg_name_ = "NormalDistributionsTransform"; diff --git a/registration/include/pcl/registration/impl/ndt_2d.hpp b/registration/include/pcl/registration/impl/ndt_2d.hpp index 98c05a42c48..3d8a7421b32 100644 --- a/registration/include/pcl/registration/impl/ndt_2d.hpp +++ b/registration/include/pcl/registration/impl/ndt_2d.hpp @@ -99,7 +99,7 @@ namespace pcl public: NormalDist () - : min_n_ (3), n_ (0), pt_indices_ (), mean_ (), covar_inv_ () + : min_n_ (3), n_ (0) { } diff --git a/registration/include/pcl/registration/impl/pyramid_feature_matching.hpp b/registration/include/pcl/registration/impl/pyramid_feature_matching.hpp index dc51263c87f..991b44778b3 100644 --- a/registration/include/pcl/registration/impl/pyramid_feature_matching.hpp +++ b/registration/include/pcl/registration/impl/pyramid_feature_matching.hpp @@ -117,7 +117,6 @@ pcl::PyramidFeatureHistogram::comparePyramidFeatureHistograms (con template pcl::PyramidFeatureHistogram::PyramidFeatureHistogram () : nr_dimensions (0), nr_levels (0), nr_features (0), - dimension_range_input_ (), dimension_range_target_ (), feature_representation_ (new DefaultPointRepresentation), is_computed_ (false), hist_levels () diff --git a/registration/include/pcl/registration/impl/transformation_estimation_point_to_plane_weighted.hpp b/registration/include/pcl/registration/impl/transformation_estimation_point_to_plane_weighted.hpp index d6994379747..2c20344e67f 100644 --- a/registration/include/pcl/registration/impl/transformation_estimation_point_to_plane_weighted.hpp +++ b/registration/include/pcl/registration/impl/transformation_estimation_point_to_plane_weighted.hpp @@ -53,7 +53,6 @@ pcl::registration::TransformationEstimationPointToPlaneWeighted) - , correspondence_weights_ () , use_correspondence_weights_ (true) { }; diff --git a/registration/include/pcl/registration/matching_candidate.h b/registration/include/pcl/registration/matching_candidate.h index 0dccb3e03e4..d869fb8e9cf 100644 --- a/registration/include/pcl/registration/matching_candidate.h +++ b/registration/include/pcl/registration/matching_candidate.h @@ -56,7 +56,6 @@ namespace pcl /** \brief Constructor. */ MatchingCandidate () : fitness_score (FLT_MAX), - correspondences (), transformation (Eigen::Matrix4f::Identity ()) {}; diff --git a/registration/include/pcl/registration/ppf_registration.h b/registration/include/pcl/registration/ppf_registration.h index f09141adbba..0c4cba256c1 100644 --- a/registration/include/pcl/registration/ppf_registration.h +++ b/registration/include/pcl/registration/ppf_registration.h @@ -75,8 +75,7 @@ namespace pcl */ PPFHashMapSearch (float angle_discretization_step = 12.0f / 180.0f * static_cast (M_PI), float distance_discretization_step = 0.01f) - : alpha_m_ () - , feature_hash_map_ (new FeatureHashMapType) + : feature_hash_map_ (new FeatureHashMapType) , internals_initialized_ (false) , angle_discretization_step_ (angle_discretization_step) , distance_discretization_step_ (distance_discretization_step) @@ -178,7 +177,6 @@ namespace pcl /** \brief Empty constructor that initializes all the parameters of the algorithm with default values */ PPFRegistration () : Registration (), - search_method_ (), scene_reference_point_sampling_rate_ (5), clustering_position_diff_threshold_ (0.01f), clustering_rotation_diff_threshold_ (20.0f / 180.0f * static_cast (M_PI)) diff --git a/registration/include/pcl/registration/pyramid_feature_matching.h b/registration/include/pcl/registration/pyramid_feature_matching.h index 30c0ce9283b..c9107b48b70 100644 --- a/registration/include/pcl/registration/pyramid_feature_matching.h +++ b/registration/include/pcl/registration/pyramid_feature_matching.h @@ -168,15 +168,11 @@ namespace pcl /** \brief Structure for representing a single pyramid histogram level */ struct PyramidFeatureHistogramLevel { - PyramidFeatureHistogramLevel () : - hist (), - bins_per_dimension (), - bin_step () + PyramidFeatureHistogramLevel () { } PyramidFeatureHistogramLevel (std::vector &a_bins_per_dimension, std::vector &a_bin_step) : - hist (), bins_per_dimension (a_bins_per_dimension), bin_step (a_bin_step) { diff --git a/registration/include/pcl/registration/registration.h b/registration/include/pcl/registration/registration.h index cf04b7c6d80..e2946a2ecf6 100644 --- a/registration/include/pcl/registration/registration.h +++ b/registration/include/pcl/registration/registration.h @@ -97,8 +97,7 @@ namespace pcl /** \brief Empty constructor. */ Registration () - : reg_name_ () - , tree_ (new KdTree) + : tree_ (new KdTree) , tree_reciprocal_ (new KdTreeReciprocal) , nr_iterations_ (0) , max_iterations_ (10) @@ -117,7 +116,6 @@ namespace pcl , correspondences_ (new Correspondences) , transformation_estimation_ () , correspondence_estimation_ () - , correspondence_rejectors_ () , target_cloud_updated_ (true) , source_cloud_updated_ (true) , force_no_recompute_ (false) diff --git a/sample_consensus/include/pcl/sample_consensus/sac.h b/sample_consensus/include/pcl/sample_consensus/sac.h index a5d18cb549c..e1ae582211e 100644 --- a/sample_consensus/include/pcl/sample_consensus/sac.h +++ b/sample_consensus/include/pcl/sample_consensus/sac.h @@ -70,14 +70,10 @@ namespace pcl */ SampleConsensus (const SampleConsensusModelPtr &model, bool random = false) : sac_model_ (model) - , model_ () - , inliers_ () - , model_coefficients_ () , probability_ (0.99) , iterations_ (0) , threshold_ (std::numeric_limits::max ()) , max_iterations_ (1000) - , rng_alg_ () , rng_ (new boost::uniform_01 (rng_alg_)) { // Create a random number generator object @@ -96,14 +92,10 @@ namespace pcl double threshold, bool random = false) : sac_model_ (model) - , model_ () - , inliers_ () - , model_coefficients_ () , probability_ (0.99) , iterations_ (0) , threshold_ (threshold) , max_iterations_ (1000) - , rng_alg_ () , rng_ (new boost::uniform_01 (rng_alg_)) { // Create a random number generator object diff --git a/sample_consensus/include/pcl/sample_consensus/sac_model.h b/sample_consensus/include/pcl/sample_consensus/sac_model.h index d6355da843f..4f382186b86 100644 --- a/sample_consensus/include/pcl/sample_consensus/sac_model.h +++ b/sample_consensus/include/pcl/sample_consensus/sac_model.h @@ -79,16 +79,11 @@ namespace pcl */ SampleConsensusModel (bool random = false) : input_ () - , indices_ () , radius_min_ (-std::numeric_limits::max ()) , radius_max_ (std::numeric_limits::max ()) , samples_radius_ (0.) , samples_radius_search_ () - , shuffled_indices_ () - , rng_alg_ () , rng_dist_ (new boost::uniform_int<> (0, std::numeric_limits::max ())) - , rng_gen_ () - , error_sqr_dists_ () { // Create a random number generator object if (random) @@ -106,16 +101,11 @@ namespace pcl */ SampleConsensusModel (const PointCloudConstPtr &cloud, bool random = false) : input_ () - , indices_ () , radius_min_ (-std::numeric_limits::max ()) , radius_max_ (std::numeric_limits::max ()) , samples_radius_ (0.) , samples_radius_search_ () - , shuffled_indices_ () - , rng_alg_ () , rng_dist_ (new boost::uniform_int<> (0, std::numeric_limits::max ())) - , rng_gen_ () - , error_sqr_dists_ () { if (random) rng_alg_.seed (static_cast (std::time (nullptr))); @@ -143,11 +133,7 @@ namespace pcl , radius_max_ (std::numeric_limits::max ()) , samples_radius_ (0.) , samples_radius_search_ () - , shuffled_indices_ () - , rng_alg_ () , rng_dist_ (new boost::uniform_int<> (0, std::numeric_limits::max ())) - , rng_gen_ () - , error_sqr_dists_ () { if (random) rng_alg_.seed (static_cast (std::time(nullptr))); diff --git a/sample_consensus/include/pcl/sample_consensus/sac_model_cone.h b/sample_consensus/include/pcl/sample_consensus/sac_model_cone.h index 46ed72f5602..6b80accd90a 100644 --- a/sample_consensus/include/pcl/sample_consensus/sac_model_cone.h +++ b/sample_consensus/include/pcl/sample_consensus/sac_model_cone.h @@ -122,7 +122,7 @@ namespace pcl SampleConsensusModelCone (const SampleConsensusModelCone &source) : SampleConsensusModel (), SampleConsensusModelFromNormals (), - axis_ (), eps_angle_ (), min_angle_ (), max_angle_ () + eps_angle_ (), min_angle_ (), max_angle_ () { *this = source; model_name_ = "SampleConsensusModelCone"; diff --git a/sample_consensus/include/pcl/sample_consensus/sac_model_registration.h b/sample_consensus/include/pcl/sample_consensus/sac_model_registration.h index 3f459f17cc7..50a16c2b5d1 100644 --- a/sample_consensus/include/pcl/sample_consensus/sac_model_registration.h +++ b/sample_consensus/include/pcl/sample_consensus/sac_model_registration.h @@ -77,8 +77,6 @@ namespace pcl bool random = false) : SampleConsensusModel (cloud, random) , target_ () - , indices_tgt_ () - , correspondences_ () , sample_dist_thresh_ (0) { // Call our own setInputCloud @@ -98,8 +96,6 @@ namespace pcl bool random = false) : SampleConsensusModel (cloud, indices, random) , target_ () - , indices_tgt_ () - , correspondences_ () , sample_dist_thresh_ (0) { computeOriginalIndexMapping (); diff --git a/search/include/pcl/search/impl/flann_search.hpp b/search/include/pcl/search/impl/flann_search.hpp index b28c822a5ed..1d5da38fd5f 100644 --- a/search/include/pcl/search/impl/flann_search.hpp +++ b/search/include/pcl/search/impl/flann_search.hpp @@ -73,8 +73,8 @@ pcl::search::FlannSearch::KdTreeMultiIndexCreator::create ////////////////////////////////////////////////////////////////////////////////////////////// template pcl::search::FlannSearch::FlannSearch(bool sorted, FlannIndexCreatorPtr creator) : pcl::search::Search ("FlannSearch",sorted), - index_(), creator_ (creator), input_flann_(), eps_ (0), checks_ (32), input_copied_for_flann_ (false), point_representation_ (new DefaultPointRepresentation), - dim_ (0), index_mapping_(), identity_mapping_() + index_(), creator_ (creator), eps_ (0), checks_ (32), input_copied_for_flann_ (false), point_representation_ (new DefaultPointRepresentation), + dim_ (0), identity_mapping_() { dim_ = point_representation_->getNumberOfDimensions (); } diff --git a/search/include/pcl/search/impl/search.hpp b/search/include/pcl/search/impl/search.hpp index d365a3a2297..7fceddb74d9 100644 --- a/search/include/pcl/search/impl/search.hpp +++ b/search/include/pcl/search/impl/search.hpp @@ -44,7 +44,6 @@ template pcl::search::Search::Search (const std::string& name, bool sorted) : input_ () - , indices_ () , sorted_results_ (sorted) , name_ (name) { diff --git a/search/include/pcl/search/organized.h b/search/include/pcl/search/organized.h index 8bdb60383d6..b16cd87e54b 100644 --- a/search/include/pcl/search/organized.h +++ b/search/include/pcl/search/organized.h @@ -91,7 +91,6 @@ namespace pcl , KR_KRT_ (Eigen::Matrix::Zero ()) , eps_ (eps) , pyramid_level_ (pyramid_level) - , mask_ () { } diff --git a/segmentation/include/pcl/segmentation/euclidean_cluster_comparator.h b/segmentation/include/pcl/segmentation/euclidean_cluster_comparator.h index 2db02e82ac6..d0e6ca269ef 100644 --- a/segmentation/include/pcl/segmentation/euclidean_cluster_comparator.h +++ b/segmentation/include/pcl/segmentation/euclidean_cluster_comparator.h @@ -73,7 +73,6 @@ namespace pcl EuclideanClusterComparator () : distance_threshold_ (0.005f) , depth_dependent_ () - , z_axis_ () {} void diff --git a/segmentation/include/pcl/segmentation/ground_plane_comparator.h b/segmentation/include/pcl/segmentation/ground_plane_comparator.h index 39bc074d0b8..58752c1502c 100644 --- a/segmentation/include/pcl/segmentation/ground_plane_comparator.h +++ b/segmentation/include/pcl/segmentation/ground_plane_comparator.h @@ -69,7 +69,6 @@ namespace pcl /** \brief Empty constructor for GroundPlaneComparator. */ GroundPlaneComparator () : normals_ () - , plane_coeff_d_ () , angular_threshold_ (cosf (pcl::deg2rad (2.0f))) , road_angular_threshold_ ( cosf(pcl::deg2rad (10.0f))) , distance_threshold_ (0.1f) diff --git a/segmentation/include/pcl/segmentation/impl/min_cut_segmentation.hpp b/segmentation/include/pcl/segmentation/impl/min_cut_segmentation.hpp index 4533ce9a5c8..8ad858193d4 100644 --- a/segmentation/include/pcl/segmentation/impl/min_cut_segmentation.hpp +++ b/segmentation/include/pcl/segmentation/impl/min_cut_segmentation.hpp @@ -61,9 +61,6 @@ pcl::MinCutSegmentation::MinCutSegmentation () : foreground_points_ (0), background_points_ (0), clusters_ (0), - graph_ (), - capacity_ (), - reverse_edges_ (), vertices_ (0), edge_marker_ (0), source_ (),///////////////////////////////// diff --git a/segmentation/include/pcl/segmentation/planar_region.h b/segmentation/include/pcl/segmentation/planar_region.h index 63943ccdb61..e1257b75886 100644 --- a/segmentation/include/pcl/segmentation/planar_region.h +++ b/segmentation/include/pcl/segmentation/planar_region.h @@ -57,15 +57,14 @@ namespace pcl public: /** \brief Empty constructor for PlanarRegion. */ - PlanarRegion () : contour_labels_ () + PlanarRegion () {} /** \brief Constructor for Planar region from a Region3D and a PlanarPolygon. * \param[in] region a Region3D for the input data * \param[in] polygon a PlanarPolygon for the input region */ - PlanarRegion (const pcl::Region3D& region, const pcl::PlanarPolygon& polygon) : - contour_labels_ () + PlanarRegion (const pcl::Region3D& region, const pcl::PlanarPolygon& polygon) { centroid_ = region.centroid; covariance_ = region.covariance; @@ -86,8 +85,7 @@ namespace pcl */ PlanarRegion (const Eigen::Vector3f& centroid, const Eigen::Matrix3f& covariance, unsigned count, const typename pcl::PointCloud::VectorType& contour, - const Eigen::Vector4f& coefficients) : - contour_labels_ () + const Eigen::Vector4f& coefficients) { centroid_ = centroid; covariance_ = covariance; diff --git a/segmentation/include/pcl/segmentation/plane_coefficient_comparator.h b/segmentation/include/pcl/segmentation/plane_coefficient_comparator.h index 963cd3dd67a..eb3bc79e81a 100644 --- a/segmentation/include/pcl/segmentation/plane_coefficient_comparator.h +++ b/segmentation/include/pcl/segmentation/plane_coefficient_comparator.h @@ -69,7 +69,6 @@ namespace pcl /** \brief Empty constructor for PlaneCoefficientComparator. */ PlaneCoefficientComparator () : normals_ () - , plane_coeff_d_ () , angular_threshold_ (pcl::deg2rad (2.0f)) , distance_threshold_ (0.02f) , depth_dependent_ (true) diff --git a/segmentation/include/pcl/segmentation/plane_refinement_comparator.h b/segmentation/include/pcl/segmentation/plane_refinement_comparator.h index b71ae489a1d..31a79a2bede 100644 --- a/segmentation/include/pcl/segmentation/plane_refinement_comparator.h +++ b/segmentation/include/pcl/segmentation/plane_refinement_comparator.h @@ -76,10 +76,7 @@ namespace pcl /** \brief Empty constructor for PlaneCoefficientComparator. */ PlaneRefinementComparator () - : models_ () - , labels_ () - , refine_labels_ () - , label_to_model_ () + : labels_ () , depth_dependent_ (false) { } @@ -93,7 +90,6 @@ namespace pcl : models_ (models) , labels_ () , refine_labels_ (refine_labels) - , label_to_model_ () , depth_dependent_ (false) { } diff --git a/segmentation/include/pcl/segmentation/seeded_hue_segmentation.h b/segmentation/include/pcl/segmentation/seeded_hue_segmentation.h index d0d9a185d31..1f81346b850 100644 --- a/segmentation/include/pcl/segmentation/seeded_hue_segmentation.h +++ b/segmentation/include/pcl/segmentation/seeded_hue_segmentation.h @@ -107,7 +107,7 @@ namespace pcl ////////////////////////////////////////////////////////////////////////////////////////////////////////////////// /** \brief Empty constructor. */ - SeededHueSegmentation () : tree_ (), cluster_tolerance_ (0), delta_hue_ (0.0) + SeededHueSegmentation () : cluster_tolerance_ (0), delta_hue_ (0.0) {}; /** \brief Provide a pointer to the search object. diff --git a/stereo/include/pcl/stereo/stereo_grabber.h b/stereo/include/pcl/stereo/stereo_grabber.h index 795efd4e76f..5cfa31e4626 100644 --- a/stereo/include/pcl/stereo/stereo_grabber.h +++ b/stereo/include/pcl/stereo/stereo_grabber.h @@ -68,7 +68,7 @@ namespace pcl /** \brief Copy constructor. * \param[in] src the Stereo Grabber base object to copy into this */ - StereoGrabberBase (const StereoGrabberBase &src) : Grabber (), impl_ () + StereoGrabberBase (const StereoGrabberBase &src) : impl_ () { *this = src; } diff --git a/stereo/src/stereo_grabber.cpp b/stereo/src/stereo_grabber.cpp index d4d3e274a31..72a4a28e70c 100644 --- a/stereo/src/stereo_grabber.cpp +++ b/stereo/src/stereo_grabber.cpp @@ -77,12 +77,7 @@ pcl::StereoGrabberBase::StereoGrabberImpl::StereoGrabberImpl (pcl::StereoGrabber , frames_per_second_ (frames_per_second) , repeat_ (repeat) , running_ (false) - , pair_files_ () - , pair_iterator_ () , time_trigger_ (1.0 / static_cast (std::max (frames_per_second, 0.001f)), boost::bind (&StereoGrabberImpl::trigger, this)) - , next_cloud_ () - , origin_ () - , orientation_ () , valid_ (false) { pair_files_.push_back (pair_files); @@ -98,12 +93,7 @@ pcl::StereoGrabberBase::StereoGrabberImpl::StereoGrabberImpl (pcl::StereoGrabber , frames_per_second_ (frames_per_second) , repeat_ (repeat) , running_ (false) - , pair_files_ () - , pair_iterator_ () , time_trigger_ (1.0 / static_cast (std::max (frames_per_second, 0.001f)), boost::bind (&StereoGrabberImpl::trigger, this)) - , next_cloud_ () - , origin_ () - , orientation_ () , valid_ (false) { pair_files_ = files; diff --git a/surface/include/pcl/surface/bilateral_upsampling.h b/surface/include/pcl/surface/bilateral_upsampling.h index f30095160eb..b9f6d3bc213 100644 --- a/surface/include/pcl/surface/bilateral_upsampling.h +++ b/surface/include/pcl/surface/bilateral_upsampling.h @@ -76,13 +76,9 @@ namespace pcl /** \brief Constructor. */ BilateralUpsampling () - : KinectVGAProjectionMatrix () - , KinectSXGAProjectionMatrix () - , window_size_ (5) + : window_size_ (5) , sigma_color_ (15.0f) , sigma_depth_ (0.5f) - , projection_matrix_ () - , unprojection_matrix_ () { KinectVGAProjectionMatrix << 525.0f, 0.0f, 320.0f, 0.0f, 525.0f, 240.0f, diff --git a/surface/include/pcl/surface/ear_clipping.h b/surface/include/pcl/surface/ear_clipping.h index f05b6a7d9e5..87dacba2097 100644 --- a/surface/include/pcl/surface/ear_clipping.h +++ b/surface/include/pcl/surface/ear_clipping.h @@ -58,7 +58,7 @@ namespace pcl using MeshProcessing::input_mesh_; using MeshProcessing::initCompute; /** \brief Empty constructor */ - EarClipping () : MeshProcessing (), points_ () + EarClipping () { }; diff --git a/surface/include/pcl/surface/gp3.h b/surface/include/pcl/surface/gp3.h index aa2ef0f431b..d54f973b722 100644 --- a/surface/include/pcl/surface/gp3.h +++ b/surface/include/pcl/surface/gp3.h @@ -169,16 +169,8 @@ namespace pcl eps_angle_(M_PI/4), //45 degrees, consistent_(false), consistent_ordering_ (false), - triangle_ (), - coords_ (), angles_ (), R_ (), - state_ (), - source_ (), - ffn_ (), - sfn_ (), - part_ (), - fringe_queue_ (), is_current_free_ (false), current_index_ (), prev_is_ffn_ (false), @@ -188,15 +180,7 @@ namespace pcl changed_1st_fn_ (false), changed_2nd_fn_ (false), new2boundary_ (), - already_connected_ (false), - proj_qp_ (), - u_ (), - v_ (), - uvn_ffn_ (), - uvn_sfn_ (), - uvn_next_ffn_ (), - uvn_next_sfn_ (), - tmp_ () + already_connected_ (false) {}; /** \brief Set the multiplier of the nearest neighbor distance to obtain the final search radius for each point @@ -345,7 +329,7 @@ namespace pcl /** \brief Struct for storing the edges starting from a fringe point **/ struct doubleEdge { - doubleEdge () : index (0), first (), second () {} + doubleEdge () : index (0) {} int index; Eigen::Vector2f first; Eigen::Vector2f second; diff --git a/surface/include/pcl/surface/grid_projection.h b/surface/include/pcl/surface/grid_projection.h index 73838650cb6..684251cc3b1 100644 --- a/surface/include/pcl/surface/grid_projection.h +++ b/surface/include/pcl/surface/grid_projection.h @@ -85,7 +85,7 @@ namespace pcl /** \brief Data leaf. */ struct Leaf { - Leaf () : data_indices (), pt_on_surface (), vect_at_grid_pt () {} + Leaf () {} std::vector data_indices; Eigen::Vector4f pt_on_surface; diff --git a/surface/include/pcl/surface/impl/grid_projection.hpp b/surface/include/pcl/surface/impl/grid_projection.hpp index dd409338698..c22f4b11e28 100644 --- a/surface/include/pcl/surface/impl/grid_projection.hpp +++ b/surface/include/pcl/surface/impl/grid_projection.hpp @@ -47,17 +47,15 @@ ////////////////////////////////////////////////////////////////////////////////////////////// template pcl::GridProjection::GridProjection () : - cell_hash_map_ (), min_p_ (), max_p_ (), leaf_size_ (0.001), gaussian_scale_ (), - data_size_ (0), max_binary_search_level_ (10), k_ (50), padding_size_ (3), data_ (), - vector_at_data_point_ (), surface_ (), occupied_cell_list_ () + cell_hash_map_ (), leaf_size_ (0.001), gaussian_scale_ (), + data_size_ (0), max_binary_search_level_ (10), k_ (50), padding_size_ (3), data_ () {} ////////////////////////////////////////////////////////////////////////////////////////////// template pcl::GridProjection::GridProjection (double resolution) : - cell_hash_map_ (), min_p_ (), max_p_ (), leaf_size_ (resolution), gaussian_scale_ (), - data_size_ (0), max_binary_search_level_ (10), k_ (50), padding_size_ (3), data_ (), - vector_at_data_point_ (), surface_ (), occupied_cell_list_ () + cell_hash_map_ (), leaf_size_ (resolution), gaussian_scale_ (), + data_size_ (0), max_binary_search_level_ (10), k_ (50), padding_size_ (3), data_ () {} ////////////////////////////////////////////////////////////////////////////////////////////// diff --git a/surface/include/pcl/surface/impl/mls.hpp b/surface/include/pcl/surface/impl/mls.hpp index 7ed38caeba7..368690f0aba 100644 --- a/surface/include/pcl/surface/impl/mls.hpp +++ b/surface/include/pcl/surface/impl/mls.hpp @@ -838,7 +838,7 @@ template pcl::MovingLeastSquares::MLSVoxelGrid::MLSVoxelGrid (PointCloudInConstPtr& cloud, IndicesPtr &indices, float voxel_size) : - voxel_grid_ (), bounding_min_ (), bounding_max_ (), data_size_ (), voxel_size_ (voxel_size) + voxel_grid_ (), data_size_ (), voxel_size_ (voxel_size) { pcl::getMinMax3D (*cloud, *indices, bounding_min_, bounding_max_); diff --git a/surface/include/pcl/surface/mls.h b/surface/include/pcl/surface/mls.h index c86a85df6a2..4fbeafa7262 100644 --- a/surface/include/pcl/surface/mls.h +++ b/surface/include/pcl/surface/mls.h @@ -295,9 +295,7 @@ namespace pcl /** \brief Empty constructor. */ MovingLeastSquares () : CloudSurfaceProcessing (), - normals_ (), distinct_cloud_ (), - search_method_ (), tree_ (), order_ (2), search_radius_ (0.0), @@ -308,14 +306,11 @@ namespace pcl upsampling_step_ (0.0), desired_num_points_in_radius_ (0), cache_mls_results_ (true), - mls_results_ (), projection_method_ (MLSResult::SIMPLE), threads_ (1), voxel_size_ (1.0), dilation_iteration_num_ (0), nr_coeff_ (), - corresponding_input_indices_ (), - rng_ (), rng_uniform_distribution_ () {}; diff --git a/surface/include/pcl/surface/processing.h b/surface/include/pcl/surface/processing.h index 803cc43bfad..196297e10a0 100644 --- a/surface/include/pcl/surface/processing.h +++ b/surface/include/pcl/surface/processing.h @@ -99,7 +99,7 @@ namespace pcl typedef PolygonMesh::ConstPtr PolygonMeshConstPtr; /** \brief Constructor. */ - MeshProcessing () : input_mesh_ () {} + MeshProcessing () {} /** \brief Destructor. */ virtual ~MeshProcessing () {} diff --git a/surface/include/pcl/surface/texture_mapping.h b/surface/include/pcl/surface/texture_mapping.h index f04bbf434e6..1c13606583b 100644 --- a/surface/include/pcl/surface/texture_mapping.h +++ b/surface/include/pcl/surface/texture_mapping.h @@ -61,8 +61,8 @@ namespace pcl */ struct Camera { - Camera () : pose (), focal_length (), focal_length_w (-1), focal_length_h (-1), - center_w (-1), center_h (-1), height (), width (), texture_file () {} + Camera () : focal_length (), focal_length_w (-1), focal_length_h (-1), + center_w (-1), center_h (-1), height (), width () {} Eigen::Affine3f pose; double focal_length; double focal_length_w; // optional @@ -114,7 +114,7 @@ namespace pcl /** \brief Constructor. */ TextureMapping () : - f_ (), vector_field_ (), tex_files_ (), tex_material_ () + f_ () { } diff --git a/surface/include/pcl/surface/vtk_smoothing/vtk_mesh_smoothing_laplacian.h b/surface/include/pcl/surface/vtk_smoothing/vtk_mesh_smoothing_laplacian.h index d2ff607d26c..67755ca69c1 100644 --- a/surface/include/pcl/surface/vtk_smoothing/vtk_mesh_smoothing_laplacian.h +++ b/surface/include/pcl/surface/vtk_smoothing/vtk_mesh_smoothing_laplacian.h @@ -53,9 +53,7 @@ namespace pcl public: /** \brief Empty constructor that sets the values of the algorithm parameters to the VTK defaults */ MeshSmoothingLaplacianVTK () - : MeshProcessing () - , vtk_polygons_ () - , num_iter_ (20) + : num_iter_ (20) , convergence_ (0.0f) , relaxation_factor_ (0.01f) , feature_edge_smoothing_ (false) diff --git a/surface/include/pcl/surface/vtk_smoothing/vtk_mesh_smoothing_windowed_sinc.h b/surface/include/pcl/surface/vtk_smoothing/vtk_mesh_smoothing_windowed_sinc.h index 6da688bab6a..7780eaadd46 100644 --- a/surface/include/pcl/surface/vtk_smoothing/vtk_mesh_smoothing_windowed_sinc.h +++ b/surface/include/pcl/surface/vtk_smoothing/vtk_mesh_smoothing_windowed_sinc.h @@ -53,8 +53,7 @@ namespace pcl public: /** \brief Empty constructor that sets the values of the algorithm parameters to the VTK defaults */ MeshSmoothingWindowedSincVTK () - : MeshProcessing (), - num_iter_ (20), + : num_iter_ (20), pass_band_ (0.1f), feature_edge_smoothing_ (false), feature_angle_ (45.f), diff --git a/surface/src/vtk_smoothing/vtk_mesh_quadric_decimation.cpp b/surface/src/vtk_smoothing/vtk_mesh_quadric_decimation.cpp index 375fb40d31d..ab39d9ce3ec 100644 --- a/surface/src/vtk_smoothing/vtk_mesh_quadric_decimation.cpp +++ b/surface/src/vtk_smoothing/vtk_mesh_quadric_decimation.cpp @@ -44,8 +44,7 @@ ////////////////////////////////////////////////////////////////////////////////////////////// pcl::MeshQuadricDecimationVTK::MeshQuadricDecimationVTK () - : pcl::MeshProcessing (), - target_reduction_factor_ (0.5f) + : target_reduction_factor_ (0.5f) { } diff --git a/surface/src/vtk_smoothing/vtk_mesh_subdivision.cpp b/surface/src/vtk_smoothing/vtk_mesh_subdivision.cpp index 9e1028765a4..58b8dff9a93 100644 --- a/surface/src/vtk_smoothing/vtk_mesh_subdivision.cpp +++ b/surface/src/vtk_smoothing/vtk_mesh_subdivision.cpp @@ -47,8 +47,7 @@ ////////////////////////////////////////////////////////////////////////////////////////////// pcl::MeshSubdivisionVTK::MeshSubdivisionVTK () - : pcl::MeshProcessing (), - filter_type_ (LINEAR) + : filter_type_ (LINEAR) { } diff --git a/test/octree/test_octree.cpp b/test/octree/test_octree.cpp index ceb88d67be6..708b996984d 100644 --- a/test/octree/test_octree.cpp +++ b/test/octree/test_octree.cpp @@ -1103,7 +1103,7 @@ TEST (PCL, Octree_Pointcloud_Voxel_Centroid_Test) class prioPointQueueEntry { public: - prioPointQueueEntry () : point_ (), pointDistance_ (), pointIdx_ () + prioPointQueueEntry () : pointDistance_ (), pointIdx_ () { } prioPointQueueEntry (PointXYZ& point_arg, double pointDistance_arg, int pointIdx_arg) : diff --git a/tools/oni_viewer_simple.cpp b/tools/oni_viewer_simple.cpp index abf22b2ca06..93cc3b159b7 100644 --- a/tools/oni_viewer_simple.cpp +++ b/tools/oni_viewer_simple.cpp @@ -80,7 +80,6 @@ class SimpleONIViewer SimpleONIViewer(pcl::ONIGrabber& grabber) : viewer("PCL OpenNI Viewer") , grabber_(grabber) - , mtx_ () , cloud_ () { } diff --git a/tools/openni2_viewer.cpp b/tools/openni2_viewer.cpp index 3db44d0dab7..65d90a71f59 100644 --- a/tools/openni2_viewer.cpp +++ b/tools/openni2_viewer.cpp @@ -117,7 +117,6 @@ class OpenNI2Viewer OpenNI2Viewer (pcl::io::OpenNI2Grabber& grabber) : cloud_viewer_ (new pcl::visualization::PCLVisualizer ("PCL OpenNI2 cloud")) - , image_viewer_ () , grabber_ (grabber) , rgb_data_ (nullptr), rgb_data_size_ (0) { diff --git a/tools/openni_save_image.cpp b/tools/openni_save_image.cpp index e8d7e8744e0..f1858aeddc1 100644 --- a/tools/openni_save_image.cpp +++ b/tools/openni_save_image.cpp @@ -75,9 +75,6 @@ class SimpleOpenNIViewer public: SimpleOpenNIViewer (pcl::OpenNIGrabber& grabber) : grabber_ (grabber) - , image_mutex_ () - , image_ () - , depth_image_ () , importer_ (vtkSmartPointer::New ()) , depth_importer_ (vtkSmartPointer::New ()) , writer_ (vtkSmartPointer::New ()) diff --git a/tools/openni_viewer.cpp b/tools/openni_viewer.cpp index c88335a20c0..c1ab8cef001 100644 --- a/tools/openni_viewer.cpp +++ b/tools/openni_viewer.cpp @@ -110,7 +110,6 @@ class OpenNIViewer OpenNIViewer (pcl::Grabber& grabber) : cloud_viewer_ (new pcl::visualization::PCLVisualizer ("PCL OpenNI cloud")) - , image_viewer_ () , grabber_ (grabber) , rgb_data_ (nullptr), rgb_data_size_ (0) { diff --git a/tracking/include/pcl/tracking/coherence.h b/tracking/include/pcl/tracking/coherence.h index cda4e1ebb1a..83672a7e913 100644 --- a/tracking/include/pcl/tracking/coherence.h +++ b/tracking/include/pcl/tracking/coherence.h @@ -21,7 +21,7 @@ namespace pcl public: /** \brief empty constructor */ - PointCoherence () : coherence_name_ () {} + PointCoherence () {} /** \brief empty distructor */ virtual ~PointCoherence () {} @@ -68,7 +68,7 @@ namespace pcl typedef typename PointCoherence::Ptr PointCoherencePtr; /** \brief Constructor. */ - PointCloudCoherence () : coherence_name_ (), target_input_ (), point_coherences_ () {} + PointCloudCoherence () : target_input_ (), point_coherences_ () {} /** \brief Destructor. */ virtual ~PointCloudCoherence () {} diff --git a/tracking/include/pcl/tracking/particle_filter.h b/tracking/include/pcl/tracking/particle_filter.h index 0de8b2425e8..1f79046dcab 100644 --- a/tracking/include/pcl/tracking/particle_filter.h +++ b/tracking/include/pcl/tracking/particle_filter.h @@ -60,14 +60,10 @@ namespace pcl , ref_ () , particles_ () , coherence_ () - , step_noise_covariance_ () - , initial_noise_covariance_ () - , initial_noise_mean_ () , resample_likelihood_thr_ (0.0) , occlusion_angle_thr_ (M_PI / 2.0) , alpha_ (15.0) , representative_state_ () - , trans_ () , use_normal_ (false) , motion_ () , motion_ratio_ (0.25) diff --git a/tracking/include/pcl/tracking/tracker.h b/tracking/include/pcl/tracking/tracker.h index b2467244dad..5b2ee30f34a 100644 --- a/tracking/include/pcl/tracking/tracker.h +++ b/tracking/include/pcl/tracking/tracker.h @@ -78,7 +78,7 @@ namespace pcl public: /** \brief Empty constructor. */ - Tracker (): tracker_name_ (), search_ () {} + Tracker (): search_ () {} /** \brief Base method for tracking for all points given in * using the indices in setIndices () diff --git a/visualization/include/pcl/visualization/image_viewer.h b/visualization/include/pcl/visualization/image_viewer.h index ca749b5df37..d8ad61a08bb 100644 --- a/visualization/include/pcl/visualization/image_viewer.h +++ b/visualization/include/pcl/visualization/image_viewer.h @@ -958,7 +958,7 @@ namespace pcl /** \brief Internal structure describing a layer. */ struct Layer { - Layer () : actor (), layer_name () {} + Layer () {} vtkSmartPointer actor; std::string layer_name; }; diff --git a/visualization/include/pcl/visualization/interactor_style.h b/visualization/include/pcl/visualization/interactor_style.h index 23418e3034b..b85b294b064 100644 --- a/visualization/include/pcl/visualization/interactor_style.h +++ b/visualization/include/pcl/visualization/interactor_style.h @@ -114,11 +114,10 @@ namespace pcl /** \brief Empty constructor. */ PCLVisualizerInteractorStyle () : - init_ (), rens_ (), cloud_actors_ (), shape_actors_ (), win_height_ (), win_width_ (), win_pos_x_ (), win_pos_y_ (), - max_win_height_ (), max_win_width_ (), use_vbos_ (false), grid_enabled_ (), grid_actor_ (), lut_enabled_ (), - lut_actor_ (), snapshot_writer_ (), wif_ (), mouse_signal_ (), keyboard_signal_ (), - point_picking_signal_ (), area_picking_signal_ (), stereo_anaglyph_mask_default_ (), - mouse_callback_ (), modifier_ (), camera_file_ (), camera_ (), camera_saved_ (), win_ (), lut_actor_id_ ("") + init_ (), win_height_ (), win_width_ (), win_pos_x_ (), win_pos_y_ (), + max_win_height_ (), max_win_width_ (), use_vbos_ (false), grid_enabled_ (), lut_enabled_ (), + stereo_anaglyph_mask_default_ (), + modifier_ (), camera_saved_ (), lut_actor_id_ ("") {} /** \brief Empty destructor */ @@ -410,7 +409,7 @@ namespace pcl static PCLHistogramVisualizerInteractorStyle *New (); /** \brief Empty constructor. */ - PCLHistogramVisualizerInteractorStyle () : wins_ (), init_ (false) {} + PCLHistogramVisualizerInteractorStyle () : init_ (false) {} /** \brief Initialization routine. Must be called before anything else. */ void diff --git a/visualization/include/pcl/visualization/pcl_visualizer.h b/visualization/include/pcl/visualization/pcl_visualizer.h index 4c661c22f54..fbfbabcb697 100644 --- a/visualization/include/pcl/visualization/pcl_visualizer.h +++ b/visualization/include/pcl/visualization/pcl_visualizer.h @@ -2038,7 +2038,7 @@ namespace pcl static FPSCallback *New () { return (new FPSCallback); } FPSCallback () : actor (), pcl_visualizer (), decimated (), last_fps(0.0f) {} - FPSCallback (const FPSCallback& src) : vtkCommand (), actor (src.actor), pcl_visualizer (src.pcl_visualizer), decimated (src.decimated), last_fps (src.last_fps) {} + FPSCallback (const FPSCallback& src) : actor (src.actor), pcl_visualizer (src.pcl_visualizer), decimated (src.decimated), last_fps (src.last_fps) {} FPSCallback& operator = (const FPSCallback& src) { actor = src.actor; pcl_visualizer = src.pcl_visualizer; decimated = src.decimated; last_fps = src.last_fps; return (*this); } void diff --git a/visualization/include/pcl/visualization/registration_visualizer.h b/visualization/include/pcl/visualization/registration_visualizer.h index 4bfc837cdb4..5bc671e79d2 100644 --- a/visualization/include/pcl/visualization/registration_visualizer.h +++ b/visualization/include/pcl/visualization/registration_visualizer.h @@ -59,17 +59,11 @@ namespace pcl public: /** \brief Empty constructor. */ RegistrationVisualizer () : - viewer_ (), - viewer_thread_ (), - registration_method_name_ (), update_visualizer_ (), first_update_flag_ (), cloud_source_ (), cloud_target_ (), - visualizer_updating_mutex_ (), cloud_intermediate_ (), - cloud_intermediate_indices_ (), - cloud_target_indices_ (), maximum_displayed_correspondences_ (0) {} diff --git a/visualization/src/common/ren_win_interact_map.cpp b/visualization/src/common/ren_win_interact_map.cpp index cfed15a032c..810f7f8a42c 100644 --- a/visualization/src/common/ren_win_interact_map.cpp +++ b/visualization/src/common/ren_win_interact_map.cpp @@ -48,8 +48,6 @@ pcl::visualization::RenWinInteract::RenWinInteract () : xy_plot_ (vtkSmartPointer::New ()) , ren_ (vtkSmartPointer::New ()) , win_ (vtkSmartPointer::New ()) - , interactor_ () - , style_ () { } diff --git a/visualization/src/histogram_visualizer.cpp b/visualization/src/histogram_visualizer.cpp index 1b842b0664c..fe8af7b0c06 100644 --- a/visualization/src/histogram_visualizer.cpp +++ b/visualization/src/histogram_visualizer.cpp @@ -58,7 +58,6 @@ using namespace std::chrono_literals; ////////////////////////////////////////////////////////////////////////////////////////////// pcl::visualization::PCLHistogramVisualizer::PCLHistogramVisualizer () : - wins_ (), exit_main_loop_timer_callback_ (vtkSmartPointer::New ()), exit_callback_ (vtkSmartPointer::New ()), stopped_ () diff --git a/visualization/src/image_viewer.cpp b/visualization/src/image_viewer.cpp index dc390e0e28b..b51c292303d 100644 --- a/visualization/src/image_viewer.cpp +++ b/visualization/src/image_viewer.cpp @@ -54,22 +54,16 @@ ////////////////////////////////////////////////////////////////////////////////////////// pcl::visualization::ImageViewer::ImageViewer (const std::string& window_title) - : interactor_ () - , mouse_command_ (vtkSmartPointer::New ()) + : mouse_command_ (vtkSmartPointer::New ()) , keyboard_command_ (vtkSmartPointer::New ()) - , exit_main_loop_timer_callback_ () - , exit_callback_ () , win_ (vtkSmartPointer::New ()) , ren_ (vtkSmartPointer::New ()) , slice_ (vtkSmartPointer::New ()) , interactor_style_ (vtkSmartPointer::New ()) - , data_ () , data_size_ (0) , stopped_ () , timer_id_ () - , layer_map_ () , algo_ (vtkSmartPointer::New ()) - , image_data_ () { interactor_ = vtkSmartPointer ::Take (vtkRenderWindowInteractorFixNew ()); diff --git a/visualization/src/pcl_visualizer.cpp b/visualization/src/pcl_visualizer.cpp index c34ff9a2d32..fd0dae6c084 100644 --- a/visualization/src/pcl_visualizer.cpp +++ b/visualization/src/pcl_visualizer.cpp @@ -123,12 +123,9 @@ ///////////////////////////////////////////////////////////////////////////////////////////// pcl::visualization::PCLVisualizer::PCLVisualizer (const std::string &name, const bool create_interactor) - : interactor_ () - , update_fps_ (vtkSmartPointer::New ()) + : update_fps_ (vtkSmartPointer::New ()) , stopped_ () , timer_id_ () - , exit_main_loop_timer_callback_ () - , exit_callback_ () , rens_ (vtkSmartPointer::New ()) , win_ (vtkSmartPointer::New ()) , style_ (vtkSmartPointer::New ()) @@ -151,12 +148,9 @@ pcl::visualization::PCLVisualizer::PCLVisualizer (const std::string &name, const ///////////////////////////////////////////////////////////////////////////////////////////// pcl::visualization::PCLVisualizer::PCLVisualizer (int &argc, char **argv, const std::string &name, PCLVisualizerInteractorStyle* style, const bool create_interactor) - : interactor_ () - , update_fps_ (vtkSmartPointer::New ()) + : update_fps_ (vtkSmartPointer::New ()) , stopped_ () , timer_id_ () - , exit_main_loop_timer_callback_ () - , exit_callback_ () , rens_ (vtkSmartPointer::New ()) , win_ (vtkSmartPointer::New ()) , style_ (style) @@ -186,12 +180,9 @@ pcl::visualization::PCLVisualizer::PCLVisualizer (int &argc, char **argv, const ///////////////////////////////////////////////////////////////////////////////////////////// pcl::visualization::PCLVisualizer::PCLVisualizer (vtkSmartPointer ren, vtkSmartPointer wind, const std::string &name, const bool create_interactor) - : interactor_ () - , update_fps_ (vtkSmartPointer::New ()) + : update_fps_ (vtkSmartPointer::New ()) , stopped_ () , timer_id_ () - , exit_main_loop_timer_callback_ () - , exit_callback_ () , rens_ (vtkSmartPointer::New ()) , win_ (wind) , style_ (vtkSmartPointer::New ()) @@ -214,12 +205,9 @@ pcl::visualization::PCLVisualizer::PCLVisualizer (vtkSmartPointer r ///////////////////////////////////////////////////////////////////////////////////////////// pcl::visualization::PCLVisualizer::PCLVisualizer (int &argc, char **argv, vtkSmartPointer ren, vtkSmartPointer wind, const std::string &name, PCLVisualizerInteractorStyle* style, const bool create_interactor) - : interactor_ () - , update_fps_ (vtkSmartPointer::New ()) + : update_fps_ (vtkSmartPointer::New ()) , stopped_ () , timer_id_ () - , exit_main_loop_timer_callback_ () - , exit_callback_ () , rens_ (vtkSmartPointer::New ()) , win_ (wind) , style_ (style) diff --git a/visualization/src/point_cloud_handlers.cpp b/visualization/src/point_cloud_handlers.cpp index 9a3326903e6..44d9210bc2c 100644 --- a/visualization/src/point_cloud_handlers.cpp +++ b/visualization/src/point_cloud_handlers.cpp @@ -788,7 +788,7 @@ pcl::visualization::PointCloudGeometryHandlerSurfaceNormal: /////////////////////////////////////////////////////////////////////////////////////////// pcl::visualization::PointCloudGeometryHandlerCustom::PointCloudGeometryHandlerCustom ( const PointCloudConstPtr &cloud, const std::string &x_field_name, const std::string &y_field_name, const std::string &z_field_name) -: pcl::visualization::PointCloudGeometryHandler::PointCloudGeometryHandler (cloud), field_name_ () +: pcl::visualization::PointCloudGeometryHandler::PointCloudGeometryHandler (cloud) { field_x_idx_ = pcl::getFieldIndex (*cloud, x_field_name); if (field_x_idx_ == -1) diff --git a/visualization/src/range_image_visualizer.cpp b/visualization/src/range_image_visualizer.cpp index 681f9da4f1c..7f5b2b7731e 100644 --- a/visualization/src/range_image_visualizer.cpp +++ b/visualization/src/range_image_visualizer.cpp @@ -36,7 +36,7 @@ #include -pcl::visualization::RangeImageVisualizer::RangeImageVisualizer (const std::string& name) : ImageViewer (name), name_ () +pcl::visualization::RangeImageVisualizer::RangeImageVisualizer (const std::string& name) : ImageViewer (name) { } diff --git a/visualization/src/window.cpp b/visualization/src/window.cpp index 52e9ddc58a1..01bde6b8656 100644 --- a/visualization/src/window.cpp +++ b/visualization/src/window.cpp @@ -52,17 +52,10 @@ pcl::visualization::Window::Window (const std::string& window_name) : stopped_ () , timer_id_ () - , mouse_signal_ () - , keyboard_signal_ () - , win_ () - , interactor_ () , mouse_command_ (vtkCallbackCommand::New ()) , keyboard_command_ (vtkCallbackCommand::New ()) , style_ (vtkSmartPointer::New ()) , rens_ (vtkSmartPointer::New ()) - , exit_main_loop_timer_callback_ () - , exit_callback_ () - { mouse_command_->SetClientData (this); mouse_command_->SetCallback (Window::MouseCallback); @@ -337,7 +330,7 @@ pcl::visualization::Window::ExitMainLoopTimerCallback::ExitMainLoopTimerCallback ///////////////////////////////////////////////////////////////////////////////////////////// pcl::visualization::Window::ExitMainLoopTimerCallback::ExitMainLoopTimerCallback ( const pcl::visualization::Window::ExitMainLoopTimerCallback& src) - : vtkCommand (), right_timer_id (src.right_timer_id), window (src.window) + : right_timer_id (src.right_timer_id), window (src.window) { } @@ -374,7 +367,7 @@ pcl::visualization::Window::ExitCallback::ExitCallback () ///////////////////////////////////////////////////////////////////////////////////////////// pcl::visualization::Window::ExitCallback::ExitCallback ( const pcl::visualization::Window::ExitCallback &src) - : vtkCommand (), window (src.window) + : window (src.window) { }