Skip to content

Commit 3d2c30b

Browse files
committed
Fix header
1 parent e3159a6 commit 3d2c30b

File tree

2 files changed

+4
-3
lines changed

2 files changed

+4
-3
lines changed

bitbots_motion/bitbots_quintic_walk/include/bitbots_quintic_walk/walk_node.hpp

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -54,7 +54,7 @@ namespace bitbots_quintic_walk {
5454
class WalkNode {
5555
public:
5656
explicit WalkNode(rclcpp::Node::SharedPtr node, const std::string &ns = "",
57-
std::vector<rclcpp::Parameter> moveit_parameters = {});
57+
const std::vector<rclcpp::Parameter> &moveit_parameters = {});
5858
bitbots_msgs::msg::JointCommand step(double dt);
5959
bitbots_msgs::msg::JointCommand step(double dt, geometry_msgs::msg::Twist::SharedPtr cmdvel_msg,
6060
sensor_msgs::msg::Imu::SharedPtr imu_msg,

bitbots_motion/bitbots_quintic_walk/include/bitbots_quintic_walk/walk_pywrapper.hpp

Lines changed: 3 additions & 2 deletions
Original file line numberDiff line numberDiff line change
@@ -23,8 +23,9 @@ using namespace ros2_python_extension;
2323

2424
class PyWalkWrapper {
2525
public:
26-
explicit PyWalkWrapper(std::string ns, std::vector<py::bytes> walk_parameter_msgs = {},
27-
std::vector<py::bytes> moveit_parameter_msgs = {}, bool force_smooth_step_transition = false);
26+
explicit PyWalkWrapper(const std::string &ns, const std::vector<py::bytes> &walk_parameter_msgs = {},
27+
const std::vector<py::bytes> &moveit_parameter_msgs = {},
28+
bool force_smooth_step_transition = false);
2829
py::bytes step(double dt, py::bytes &cmdvel_msg, py::bytes &imu_msg, py::bytes &jointstate_msg,
2930
py::bytes &pressure_left, py::bytes &pressure_right);
3031
py::bytes step_relative(double dt, py::bytes &step_msg, py::bytes &imu_msg, py::bytes &jointstate_msg,

0 commit comments

Comments
 (0)