Skip to content

Commit

Permalink
Merge PR2994 from SamerKhshiboun: Fix lpcl topic name
Browse files Browse the repository at this point in the history
  • Loading branch information
SamerKhshiboun authored Feb 5, 2024
2 parents 471f5a2 + a187f42 commit ec7c093
Showing 1 changed file with 1 addition and 1 deletion.
2 changes: 1 addition & 1 deletion realsense2_camera/src/rs_node_setup.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -279,7 +279,7 @@ void BaseRealSenseNode::startPublishers(const std::vector<stream_profile>& profi

// special handling for labeled point cloud stream, since it a topic of PointCloud messages
// and not a normal image publisher
_labeled_pointcloud_publisher = _node.create_publisher<sensor_msgs::msg::PointCloud2>("labeled_point_cloud/points",
_labeled_pointcloud_publisher = _node.create_publisher<sensor_msgs::msg::PointCloud2>("~/labeled_point_cloud/points",
rclcpp::QoS(rclcpp::QoSInitialization::from_rmw(qos),qos));
}
}
Expand Down

0 comments on commit ec7c093

Please sign in to comment.