Skip to content

Commit

Permalink
Uncrustify
Browse files Browse the repository at this point in the history
  • Loading branch information
rotu committed Aug 8, 2019
1 parent a111076 commit 02dfb32
Show file tree
Hide file tree
Showing 4 changed files with 7 additions and 4 deletions.
5 changes: 4 additions & 1 deletion nav2_bt_navigator/src/bt_navigator.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -45,7 +45,10 @@ BtNavigator::on_configure(const rclcpp_lifecycle::State & /*state*/)
RCLCPP_INFO(get_logger(), "Configuring");
auto node = shared_from_this();

auto options = rclcpp::NodeOptions().arguments( { "--ros-args", std::string("__node:=") + get_name() + "_client_node", "--"});
auto options = rclcpp::NodeOptions().arguments(
{"--ros-args",
std::string("__node:=") + get_name() + "_client_node",
"--"});
// Support for handling the topic-based goal pose from rviz
client_node_ = std::make_shared<rclcpp::Node>("_", options);

Expand Down
2 changes: 1 addition & 1 deletion nav2_costmap_2d/src/costmap_2d_ros.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -58,7 +58,7 @@ Costmap2DROS::Costmap2DROS(const std::string & name)
{
RCLCPP_INFO(get_logger(), "Creating");
auto options = rclcpp::NodeOptions().arguments(
{"--ros-args", std::string("__node:=") + get_name() + "_client","--"});
{"--ros-args", std::string("__node:=") + get_name() + "_client", "--"});
client_node_ = std::make_shared<rclcpp::Node>("_", options);

std::vector<std::string> plugin_names{"static_layer", "obstacle_layer", "inflation_layer"};
Expand Down
2 changes: 1 addition & 1 deletion nav2_lifecycle_manager/src/lifecycle_manager.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -55,7 +55,7 @@ LifecycleManager::LifecycleManager()
std::bind(&LifecycleManager::shutdownCallback, this, _1, _2, _3));

auto options = rclcpp::NodeOptions().arguments(
{"--ros-args", std::string("__node:=") + get_name() + "service_client", "--"});
{"--ros-args", std::string("__node:=") + get_name() + "service_client", "--"});
service_client_node_ = std::make_shared<rclcpp::Node>("_", options);

transition_state_map_[Transition::TRANSITION_CONFIGURE] = State::PRIMARY_STATE_INACTIVE;
Expand Down
2 changes: 1 addition & 1 deletion nav2_rviz_plugins/src/navigation_dialog.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -43,7 +43,7 @@ NavigationDialog::NavigationDialog(QWidget * parent)
: QDialog(parent)
{
auto options = rclcpp::NodeOptions().arguments(
{"--ros-args", "__node:=navigation_dialog_action_client","--"});
{"--ros-args", "__node:=navigation_dialog_action_client", "--"});
client_node_ = std::make_shared<rclcpp::Node>("_", options);
action_client_ = rclcpp_action::create_client<nav2_msgs::action::NavigateToPose>(client_node_,
"NavigateToPose");
Expand Down

0 comments on commit 02dfb32

Please sign in to comment.