Skip to content

Commit

Permalink
Fix deprecation warning
Browse files Browse the repository at this point in the history
  • Loading branch information
rhaschke committed Jul 19, 2024
1 parent a7fe0df commit d2b1c51
Showing 1 changed file with 1 addition and 2 deletions.
Original file line number Diff line number Diff line change
Expand Up @@ -96,7 +96,6 @@ void PointCloudOctomapUpdater::start()
if (!ns_.empty())
prefix = ns_ + "/";

rclcpp::QoS qos(rclcpp::QoSInitialization::from_rmw(rmw_qos_profile_sensor_data));
if (!filtered_cloud_topic_.empty())
{
filtered_cloud_publisher_ =
Expand All @@ -107,7 +106,7 @@ void PointCloudOctomapUpdater::start()
return;
/* subscribe to point cloud topic using tf filter*/
point_cloud_subscriber_ = new message_filters::Subscriber<sensor_msgs::msg::PointCloud2>(node_, point_cloud_topic_,
rmw_qos_profile_sensor_data);
rclcpp::SensorDataQoS());
if (tf_listener_ && tf_buffer_ && !monitor_->getMapFrame().empty())
{
point_cloud_filter_ = new tf2_ros::MessageFilter<sensor_msgs::msg::PointCloud2>(
Expand Down

0 comments on commit d2b1c51

Please sign in to comment.