Skip to content

Commit

Permalink
Fix linters
Browse files Browse the repository at this point in the history
Signed-off-by: Emerson Knapp <eknapp@amazon.com>
  • Loading branch information
Emerson Knapp committed Apr 6, 2021
1 parent a37da03 commit 5c36ca2
Show file tree
Hide file tree
Showing 3 changed files with 9 additions and 3 deletions.
1 change: 1 addition & 0 deletions ros2bag/ros2bag/verb/play.py
Original file line number Diff line number Diff line change
Expand Up @@ -27,6 +27,7 @@
from rosbag2_py import StorageOptions
import yaml


def positive_float(arg: str) -> float:
value = float(arg)
if value <= 0:
Expand Down
7 changes: 4 additions & 3 deletions rosbag2_transport/src/rosbag2_transport/player.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -96,9 +96,10 @@ void Player::play(const PlayOptions & options)
{
rclcpp::executors::SingleThreadedExecutor exec;
exec.add_node(transport_node_);
auto spin_thread = std::thread([&exec]() {
exec.spin();
});
auto spin_thread = std::thread(
[&exec]() {
exec.spin();
});

if (reader_->has_next()) {
// Reader does not have "peek", so we must "pop" the first message to see its timestamp
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -14,6 +14,10 @@

#include <gmock/gmock.h>

#include <memory>
#include <utility>
#include <vector>

#include "rosbag2_transport/rosbag2_transport.hpp"
#include "rosgraph_msgs/msg/clock.hpp"
#include "test_msgs/message_fixtures.hpp"
Expand Down

0 comments on commit 5c36ca2

Please sign in to comment.