Skip to content

Commit

Permalink
alphabetical order
Browse files Browse the repository at this point in the history
Signed-off-by: ijnek <[email protected]>
  • Loading branch information
ijnek committed Sep 2, 2023
1 parent 7cab246 commit 159dd77
Showing 1 changed file with 1 addition and 1 deletion.
2 changes: 1 addition & 1 deletion src/rcss3d_nao_node.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -36,10 +36,10 @@ Rcss3dNaoNode::Rcss3dNaoNode(const rclcpp::NodeOptions & options)
std::string rcss3d_host = this->declare_parameter<std::string>("rcss3d/host", "127.0.0.1");
int rcss3d_port = this->declare_parameter<int>("rcss3d/port", 3100);
std::string team = this->declare_parameter<std::string>("team", "Anonymous");
double theta = this->declare_parameter<double>("theta", 0.0);
int unum = this->declare_parameter<int>("unum", 0);
double x = this->declare_parameter<double>("x", 0.0);
double y = this->declare_parameter<double>("y", 0.0);
double theta = this->declare_parameter<double>("theta", 0.0);

// Create Rcss3dAgent
params = std::make_unique<rcss3d_agent::Params>(model, rcss3d_host, rcss3d_port, team, unum);
Expand Down

0 comments on commit 159dd77

Please sign in to comment.