Skip to content

Commit

Permalink
minor
Browse files Browse the repository at this point in the history
Signed-off-by: PRP <[email protected]>
  • Loading branch information
padhupradheep committed Feb 2, 2024
1 parent 951549a commit 495fced
Show file tree
Hide file tree
Showing 2 changed files with 8 additions and 8 deletions.
2 changes: 1 addition & 1 deletion nav2_rviz_plugins/include/nav2_rviz_plugins/selector.hpp
Original file line number Diff line number Diff line change
Expand Up @@ -54,7 +54,7 @@ class Selector : public rviz_common::Panel
bool plugins_loaded_ = false;

QBasicTimer timer_;
QVBoxLayout * main_layout;
QVBoxLayout * main_layout_;
QComboBox * controller_;
QComboBox * planner_;

Expand Down
14 changes: 7 additions & 7 deletions nav2_rviz_plugins/src/selector.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -30,18 +30,18 @@ Selector::Selector(QWidget * parent)
client_node_->create_publisher<std_msgs::msg::String>("controller_selector", qos);
pub_planner_ = client_node_->create_publisher<std_msgs::msg::String>("planner_selector", qos);

main_layout = new QVBoxLayout;
main_layout_ = new QVBoxLayout;
controller_ = new QComboBox;
planner_ = new QComboBox;

main_layout->setContentsMargins(10, 10, 10, 10);
main_layout_->setContentsMargins(10, 10, 10, 10);

main_layout->addWidget(new QLabel("Controller"));
main_layout->addWidget(controller_);
main_layout->addWidget(new QLabel("Planner"));
main_layout->addWidget(planner_);
main_layout_->addWidget(new QLabel("Controller"));
main_layout_->addWidget(controller_);
main_layout_->addWidget(new QLabel("Planner"));
main_layout_->addWidget(planner_);

setLayout(main_layout);
setLayout(main_layout_);
timer_.start(200, this);

connect(
Expand Down

0 comments on commit 495fced

Please sign in to comment.