Skip to content

Commit

Permalink
Rename CreateNodeOptions() -> create_node_options()
Browse files Browse the repository at this point in the history
Signed-off-by: Rebecca Butler <rebecca@openrobotics.org>
  • Loading branch information
rebecca-butler committed Aug 6, 2021
1 parent 67e26d1 commit c3afff1
Show file tree
Hide file tree
Showing 2 changed files with 3 additions and 3 deletions.
2 changes: 1 addition & 1 deletion include/domain_bridge/component_manager.hpp
Original file line number Diff line number Diff line change
Expand Up @@ -32,7 +32,7 @@ class ComponentManager : public rclcpp_components::ComponentManager
protected:
DOMAIN_BRIDGE_PUBLIC
rclcpp::NodeOptions
CreateNodeOptions(const std::shared_ptr<LoadNode::Request> request) override;
create_node_options(const std::shared_ptr<LoadNode::Request> request) override;

private:
std::unordered_map<std::size_t, std::shared_ptr<rclcpp::Context>> contexts_;
Expand Down
4 changes: 2 additions & 2 deletions src/domain_bridge/component_manager.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -20,9 +20,9 @@ namespace domain_bridge
{

rclcpp::NodeOptions
ComponentManager::CreateNodeOptions(const std::shared_ptr<LoadNode::Request> request)
ComponentManager::create_node_options(const std::shared_ptr<LoadNode::Request> request)
{
auto options = rclcpp_components::ComponentManager::CreateNodeOptions(request);
auto options = rclcpp_components::ComponentManager::create_node_options(request);

for (const auto & a : request->extra_arguments) {
const rclcpp::Parameter extra_argument = rclcpp::Parameter::from_parameter_msg(a);
Expand Down

0 comments on commit c3afff1

Please sign in to comment.