Skip to content

Commit

Permalink
feedback
Browse files Browse the repository at this point in the history
Signed-off-by: Alejandro Hernández Cordero <[email protected]>
  • Loading branch information
ahcorde committed Jun 3, 2024
1 parent a97b8a9 commit 469aeff
Showing 1 changed file with 0 additions and 16 deletions.
Original file line number Diff line number Diff line change
Expand Up @@ -220,22 +220,6 @@ class PointCloudTransport : public PointCloudTransportLoader
getTransportOrDefault(transport_hints), custom_qos, options);
}

//! Subscribe to a point cloud topic, version for arbitrary std::function object.
POINT_CLOUD_TRANSPORT_PUBLIC
point_cloud_transport::Subscriber subscribe(
const std::string & base_topic, rmw_qos_profile_t custom_qos,
const std::function<void(const sensor_msgs::msg::PointCloud2::ConstSharedPtr &)> & callback,
const VoidPtr & tracked_object = {},
const point_cloud_transport::TransportHints * transport_hints = nullptr,
rclcpp::SubscriptionOptions options = rclcpp::SubscriptionOptions())
{
(void)tracked_object;
return Subscriber(
node_, base_topic, callback, sub_loader_,
getTransportOrDefault(transport_hints), custom_qos, options);
}


//! Subscribe to a point cloud topic, version for arbitrary std::function object.
POINT_CLOUD_TRANSPORT_PUBLIC
point_cloud_transport::Subscriber subscribe(
Expand Down

0 comments on commit 469aeff

Please sign in to comment.