Skip to content

Commit b7e4d8e

Browse files
authored
Removed deprecation warnings (#16)
Signed-off-by: Alejandro Hernandez Cordero <[email protected]>
1 parent 89521c4 commit b7e4d8e

File tree

2 files changed

+2
-2
lines changed

2 files changed

+2
-2
lines changed

src/my_publisher.cpp

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -51,7 +51,7 @@ int main(int argc, char ** argv)
5151

5252
auto node = std::make_shared<rclcpp::Node>("point_cloud_publisher");
5353

54-
point_cloud_transport::PointCloudTransport pct(node);
54+
point_cloud_transport::PointCloudTransport pct(*node);
5555
point_cloud_transport::Publisher pub = pct.advertise("pct/point_cloud", 100);
5656

5757
const std::string bagged_cloud_topic = "/point_cloud";

src/my_subscriber.cpp

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -37,7 +37,7 @@ int main(int argc, char ** argv)
3737
rclcpp::init(argc, argv);
3838
auto node = std::make_shared<rclcpp::Node>("point_cloud_subscriber");
3939

40-
point_cloud_transport::PointCloudTransport pct(node);
40+
point_cloud_transport::PointCloudTransport pct(*node);
4141
point_cloud_transport::Subscriber pct_sub = pct.subscribe(
4242
"pct/point_cloud", 100,
4343
[node](const sensor_msgs::msg::PointCloud2::ConstSharedPtr & msg)

0 commit comments

Comments
 (0)