Skip to content

Commit

Permalink
Tweak
Browse files Browse the repository at this point in the history
Signed-off-by: Carlos Agüero <[email protected]>
  • Loading branch information
caguero committed Apr 10, 2024
1 parent 82f4ffb commit 968a9dc
Show file tree
Hide file tree
Showing 2 changed files with 0 additions and 7 deletions.
3 changes: 0 additions & 3 deletions ros_gz_bridge/include/ros_gz_bridge/ros_gz_bridge.hpp
Original file line number Diff line number Diff line change
Expand Up @@ -37,9 +37,6 @@ class RosGzBridge : public rclcpp::Node
/// \param[in] options options control creation of the ROS 2 node
explicit RosGzBridge(const rclcpp::NodeOptions & options = rclcpp::NodeOptions());

/// \brief Destructor
~RosGzBridge();

/// \brief Add a new ROS-GZ bridge to the node
/// \param[in] config Parameters to control creation of a new bridge
void add_bridge(const BridgeConfig & config);
Expand Down
4 changes: 0 additions & 4 deletions ros_gz_bridge/src/ros_gz_bridge.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -41,10 +41,6 @@ RosGzBridge::RosGzBridge(const rclcpp::NodeOptions & options)
std::bind(&RosGzBridge::spin, this));
}

RosGzBridge::~RosGzBridge()
{
}

void RosGzBridge::spin()
{
if (handles_.empty()) {
Expand Down

0 comments on commit 968a9dc

Please sign in to comment.