Skip to content

Commit 2c0d965

Browse files
committed
Cpplint
1 parent f306397 commit 2c0d965

File tree

1 file changed

+2
-1
lines changed

1 file changed

+2
-1
lines changed

rosbag2_transport/include/rosbag2_transport/play_options.hpp

Lines changed: 2 additions & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -183,7 +183,8 @@ void declare_play_options_rw_params(std::shared_ptr<rclcpp::Node> nh, PlayOption
183183

184184
// TODO(roncapat): but I think it's worth to use classic CLI/launchfile remap instead
185185
// po.topic_remapping_options =
186-
// nh->declare_parameter<std::vector<std::string>>("play.topic_remapping_options", empty_str_list);
186+
// nh->declare_parameter<std::vector<std::string>>(
187+
// "play.topic_remapping_options", empty_str_list);
187188

188189
po.clock_publish_frequency = nh->declare_parameter<double>(
189190
"play.clock_publish_frequency",

0 commit comments

Comments
 (0)