Skip to content

Commit 0924bdd

Browse files
committed
Fix deprecation warning
1 parent a0a5a63 commit 0924bdd

File tree

1 file changed

+1
-2
lines changed

1 file changed

+1
-2
lines changed

moveit_ros/perception/pointcloud_octomap_updater/src/pointcloud_octomap_updater.cpp

+1-2
Original file line numberDiff line numberDiff line change
@@ -96,7 +96,6 @@ void PointCloudOctomapUpdater::start()
9696
if (!ns_.empty())
9797
prefix = ns_ + "/";
9898

99-
rclcpp::QoS qos(rclcpp::QoSInitialization::from_rmw(rmw_qos_profile_sensor_data));
10099
if (!filtered_cloud_topic_.empty())
101100
{
102101
filtered_cloud_publisher_ =
@@ -107,7 +106,7 @@ void PointCloudOctomapUpdater::start()
107106
return;
108107
/* subscribe to point cloud topic using tf filter*/
109108
point_cloud_subscriber_ = new message_filters::Subscriber<sensor_msgs::msg::PointCloud2>(node_, point_cloud_topic_,
110-
rmw_qos_profile_sensor_data);
109+
rclcpp::SensorDataQoS());
111110
if (tf_listener_ && tf_buffer_ && !monitor_->getMapFrame().empty())
112111
{
113112
point_cloud_filter_ = new tf2_ros::MessageFilter<sensor_msgs::msg::PointCloud2>(

0 commit comments

Comments
 (0)