Skip to content

Commit

Permalink
add CONTROLLER_MANAGER_PUBLIC visibility macros
Browse files Browse the repository at this point in the history
  • Loading branch information
saikishor committed Feb 6, 2025
1 parent 3e0fefe commit b7c0f77
Showing 1 changed file with 2 additions and 0 deletions.
Original file line number Diff line number Diff line change
Expand Up @@ -80,12 +80,14 @@ class ControllerManager : public rclcpp::Node
const std::string & namespace_ = "",
const rclcpp::NodeOptions & options = get_cm_node_options());

CONTROLLER_MANAGER_PUBLIC
virtual ~ControllerManager();

/// Shutdown all controllers in the controller manager.
/**
* \return true if all controllers are successfully shutdown, false otherwise.
*/
CONTROLLER_MANAGER_PUBLIC
bool shutdown_controllers();

void robot_description_callback(const std_msgs::msg::String & msg);
Expand Down

0 comments on commit b7c0f77

Please sign in to comment.