diff --git a/pcl_ros/CMakeLists.txt b/pcl_ros/CMakeLists.txt
index ddfb7bea..b45e67f5 100644
--- a/pcl_ros/CMakeLists.txt
+++ b/pcl_ros/CMakeLists.txt
@@ -178,7 +178,7 @@ ament_target_dependencies(pointcloud_to_pcd_lib
tf2_ros)
rclcpp_components_register_node(pointcloud_to_pcd_lib
PLUGIN "pcl_ros::PointCloudToPCD"
- EXECUTABLE pointcloud_to_pcd)
+ EXECUTABLE pointcloud_to_pcd)
#
#add_executable(pointcloud_to_pcd tools/pointcloud_to_pcd.cpp)
@@ -236,7 +236,7 @@ install(
pcl_ros_filters
# pcl_ros_surface
# pcl_ros_segmentation
- pointcloud_to_pcd_lib
+ pointcloud_to_pcd_lib
# bag_to_pcd
# convert_pcd_to_image
# convert_pointcloud_to_image
diff --git a/pcl_ros/package.xml b/pcl_ros/package.xml
index 4b05048f..bd13fb5a 100644
--- a/pcl_ros/package.xml
+++ b/pcl_ros/package.xml
@@ -27,6 +27,8 @@
ament_cmake
+ libpcl-all-dev
+
libpcl-all-dev
eigen
diff --git a/pcl_ros/tools/pointcloud_to_pcd.cpp b/pcl_ros/tools/pointcloud_to_pcd.cpp
index 05bb5fca..ceece178 100644
--- a/pcl_ros/tools/pointcloud_to_pcd.cpp
+++ b/pcl_ros/tools/pointcloud_to_pcd.cpp
@@ -47,14 +47,13 @@ Cloud Data) file format.
#include
#include
#include
+#include
+#include
#include
-#include "rclcpp_components/register_node_macro.hpp"
+#include
#include
#include
-#include
-#include
-
namespace pcl_ros
{