Skip to content

Commit

Permalink
Remove in_recording_ variable for ABI compatibility
Browse files Browse the repository at this point in the history
Signed-off-by: Michael Orlov <[email protected]>
  • Loading branch information
MichaelOrlov committed Jun 27, 2023
1 parent 7b15851 commit 4348b22
Show file tree
Hide file tree
Showing 2 changed files with 1 addition and 8 deletions.
2 changes: 1 addition & 1 deletion rosbag2_transport/include/rosbag2_transport/recorder.hpp
Original file line number Diff line number Diff line change
Expand Up @@ -164,7 +164,7 @@ class Recorder : public rclcpp::Node
std::unordered_set<std::string> topic_unknown_types_;
rclcpp::Service<rosbag2_interfaces::srv::Snapshot>::SharedPtr srv_snapshot_;
std::atomic<bool> paused_ = false;
std::atomic<bool> in_recording_ = false;

// Keyboard handler
std::shared_ptr<KeyboardHandler> keyboard_handler_;
// Toogle paused key callback handle
Expand Down
7 changes: 0 additions & 7 deletions rosbag2_transport/src/rosbag2_transport/recorder.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -141,18 +141,11 @@ void Recorder::stop()
if (event_publisher_thread_.joinable()) {
event_publisher_thread_.join();
}
in_recording_ = false;
RCLCPP_INFO(get_logger(), "Recording stopped");
}

void Recorder::record()
{
if (in_recording_.exchange(true)) {
RCLCPP_WARN_STREAM(
get_logger(),
"Called Recorder::record() while already in recording, dismissing request.");
return;
}
stop_discovery_ = record_options_.is_discovery_disabled;
paused_ = record_options_.start_paused;
topic_qos_profile_overrides_ = record_options_.topic_qos_profile_overrides;
Expand Down

0 comments on commit 4348b22

Please sign in to comment.