From 25ce02a085c047f64c1d0e1c9a21cf51e77786c2 Mon Sep 17 00:00:00 2001 From: ARK3r Date: Thu, 29 Jun 2023 15:27:29 -0400 Subject: [PATCH] format --- .../carlikebot_ackermann.ros2_control.xacro | 2 +- ...arlikebot_ackermann_description.urdf.xacro | 18 ++-- example_11/hardware/carlikebot_system.cpp | 95 +++++++++---------- .../carlikebot_system.hpp | 7 +- 4 files changed, 59 insertions(+), 63 deletions(-) diff --git a/example_11/description/ros2_control/carlikebot_ackermann.ros2_control.xacro b/example_11/description/ros2_control/carlikebot_ackermann.ros2_control.xacro index 8cdcee0ef..4f6e44cd0 100644 --- a/example_11/description/ros2_control/carlikebot_ackermann.ros2_control.xacro +++ b/example_11/description/ros2_control/carlikebot_ackermann.ros2_control.xacro @@ -30,4 +30,4 @@ - \ No newline at end of file + diff --git a/example_11/description/urdf/carlikebot_ackermann_description.urdf.xacro b/example_11/description/urdf/carlikebot_ackermann_description.urdf.xacro index 0657851b6..534bc9135 100644 --- a/example_11/description/urdf/carlikebot_ackermann_description.urdf.xacro +++ b/example_11/description/urdf/carlikebot_ackermann_description.urdf.xacro @@ -59,7 +59,7 @@ - + @@ -83,7 +83,7 @@ iyy="${wheel_mass / 12.0 * wheel_radius*wheel_radius}" iyz="0.0" izz="${wheel_mass / 12.0 * wheel_radius*wheel_radius}"/> - + @@ -96,14 +96,14 @@ - + - + @@ -111,7 +111,7 @@ - + @@ -120,7 +120,7 @@ iyy="${wheel_mass / 12.0 * wheel_radius*wheel_radius}" iyz="0.0" izz="${wheel_mass / 12.0 * wheel_radius*wheel_radius}"/> - + @@ -129,7 +129,7 @@ - + @@ -137,7 +137,7 @@ - + @@ -211,4 +211,4 @@ - \ No newline at end of file + diff --git a/example_11/hardware/carlikebot_system.cpp b/example_11/hardware/carlikebot_system.cpp index 919b1a4cd..89daa0d12 100644 --- a/example_11/hardware/carlikebot_system.cpp +++ b/example_11/hardware/carlikebot_system.cpp @@ -59,8 +59,8 @@ hardware_interface::CallbackReturn CarlikeBotSystemHardware::on_init( } RCLCPP_INFO( - rclcpp::get_logger("CarlikeBotSystemHardware"), - "CarlikeBotSystemHardware is %s.", m_running_simulation ? "running in simulation" : "running on hardware"); + rclcpp::get_logger("CarlikeBotSystemHardware"), "CarlikeBotSystemHardware is %s.", + m_running_simulation ? "running in simulation" : "running on hardware"); // All joints should have one state interface and one command interface for (const hardware_interface::ComponentInfo & joint : info_.joints) @@ -92,18 +92,16 @@ hardware_interface::CallbackReturn CarlikeBotSystemHardware::on_init( { RCLCPP_FATAL( rclcpp::get_logger("CarlikeBotSystemHardware"), - "Joint '%s' has %s command interface. '%s' expected.", - joint.name.c_str(), joint.command_interfaces[0].name.c_str(), - hardware_interface::HW_IF_POSITION); + "Joint '%s' has %s command interface. '%s' expected.", joint.name.c_str(), + joint.command_interfaces[0].name.c_str(), hardware_interface::HW_IF_POSITION); } if (joint.state_interfaces[0].name != hardware_interface::HW_IF_POSITION) { RCLCPP_FATAL( rclcpp::get_logger("CarlikeBotSystemHardware"), - "Joint '%s' has %s state interface. '%s' expected.", - joint.name.c_str(), joint.state_interfaces[0].name.c_str(), - hardware_interface::HW_IF_POSITION); + "Joint '%s' has %s state interface. '%s' expected.", joint.name.c_str(), + joint.state_interfaces[0].name.c_str(), hardware_interface::HW_IF_POSITION); } } else @@ -113,25 +111,22 @@ hardware_interface::CallbackReturn CarlikeBotSystemHardware::on_init( { RCLCPP_FATAL( rclcpp::get_logger("CarlikeBotSystemHardware"), - "Joint '%s' has %s command interface. '%s' expected.", - joint.name.c_str(), joint.command_interfaces[0].name.c_str(), - hardware_interface::HW_IF_VELOCITY); + "Joint '%s' has %s command interface. '%s' expected.", joint.name.c_str(), + joint.command_interfaces[0].name.c_str(), hardware_interface::HW_IF_VELOCITY); } if (joint.state_interfaces[0].name != hardware_interface::HW_IF_VELOCITY) { RCLCPP_FATAL( rclcpp::get_logger("CarlikeBotSystemHardware"), - "Joint '%s' has %s state interface. '%s' expected.", - joint.name.c_str(), joint.state_interfaces[0].name.c_str(), - hardware_interface::HW_IF_VELOCITY); + "Joint '%s' has %s state interface. '%s' expected.", joint.name.c_str(), + joint.state_interfaces[0].name.c_str(), hardware_interface::HW_IF_VELOCITY); } } - - } - // Running in simulation: we have individual control of two front steering wheels and two rear drive wheels + // Running in simulation: we have individual control of two front steering wheels and two rear + // drive wheels if (m_running_simulation) { // BEGIN: This part here is for exemplary purposes - Please do not copy to your production code @@ -161,7 +156,7 @@ hardware_interface::CallbackReturn CarlikeBotSystemHardware::on_init( std::vector CarlikeBotSystemHardware::export_state_interfaces() { std::vector state_interfaces; - + // int commands_idx = 0; for (auto i = 0u; i < info_.joints.size(); i++) @@ -172,37 +167,37 @@ std::vector CarlikeBotSystemHardware::export rclcpp::get_logger("CarlikeBotSystemHardware"), "Joint '%s' has state interfaces: '%s', '%s'.", info_.joints[i].name.c_str(), info_.joints[i].state_interfaces[0].name.c_str(), - info_.joints[i].state_interfaces[1].name.c_str() - ); + info_.joints[i].state_interfaces[1].name.c_str()); if (is_steering_joint) { - // hw_positions_.insert(std::make_pair(info_.joints[i].name, std::numeric_limits::quiet_NaN())); + // hw_positions_.insert(std::make_pair(info_.joints[i].name, + // std::numeric_limits::quiet_NaN())); state_interfaces.emplace_back(hardware_interface::StateInterface( info_.joints[i].name, hardware_interface::HW_IF_POSITION, &hw_positions_[0])); - // hw_names_.emplace_back(info_.joints[i].name, hardware_interface::HW_IF_POSITION, commands_idx); - // commands_idx++; + // hw_names_.emplace_back(info_.joints[i].name, hardware_interface::HW_IF_POSITION, + // commands_idx); commands_idx++; } else { - // hw_velocities_.insert(std::make_pair(info_.joints[i].name, std::numeric_limits::quiet_NaN())); + // hw_velocities_.insert(std::make_pair(info_.joints[i].name, + // std::numeric_limits::quiet_NaN())); state_interfaces.emplace_back(hardware_interface::StateInterface( info_.joints[i].name, hardware_interface::HW_IF_VELOCITY, &hw_velocities_[0])); - // hw_names_.emplace_back(info_.joints[i].name, hardware_interface::HW_IF_VELOCITY, commands_idx); - // commands_idx++; + // hw_names_.emplace_back(info_.joints[i].name, hardware_interface::HW_IF_VELOCITY, + // commands_idx); commands_idx++; } } RCLCPP_INFO( - rclcpp::get_logger("CarlikeBotSystemHardware"), - "Exported %zu state interfaces.", state_interfaces.size() - ); + rclcpp::get_logger("CarlikeBotSystemHardware"), "Exported %zu state interfaces.", + state_interfaces.size()); for (auto s : state_interfaces) { RCLCPP_INFO( - rclcpp::get_logger("CarlikeBotSystemHardware"), - "Exported state interface '%s'.", s.get_name().c_str()); + rclcpp::get_logger("CarlikeBotSystemHardware"), "Exported state interface '%s'.", + s.get_name().c_str()); } return state_interfaces; @@ -225,7 +220,8 @@ CarlikeBotSystemHardware::export_command_interfaces() { command_interfaces.emplace_back(hardware_interface::CommandInterface( info_.joints[i].name, hardware_interface::HW_IF_POSITION, &hw_commands_[i])); - commands_counterpart_.emplace_back(commands_counter, hardware_interface::HW_IF_POSITION, position_commands_counter); + commands_counterpart_.emplace_back( + commands_counter, hardware_interface::HW_IF_POSITION, position_commands_counter); position_commands_counter++; commands_counter++; } @@ -233,29 +229,31 @@ CarlikeBotSystemHardware::export_command_interfaces() { command_interfaces.emplace_back(hardware_interface::CommandInterface( info_.joints[i].name, hardware_interface::HW_IF_VELOCITY, &hw_commands_[i])); - commands_counterpart_.emplace_back(commands_counter, hardware_interface::HW_IF_VELOCITY, velocity_commands_counter); + commands_counterpart_.emplace_back( + commands_counter, hardware_interface::HW_IF_VELOCITY, velocity_commands_counter); velocity_commands_counter++; commands_counter++; } } RCLCPP_INFO( - rclcpp::get_logger("CarlikeBotSystemHardware"), - "Exported %zu command interfaces.", command_interfaces.size() - ); + rclcpp::get_logger("CarlikeBotSystemHardware"), "Exported %zu command interfaces.", + command_interfaces.size()); for (int i = 0u; i < commands_positions_idx_.size(); i++) { RCLCPP_INFO( rclcpp::get_logger("CarlikeBotSystemHardware"), - "Exported position joint %d at command interface %d.", commands_positions_idx_[i].first, commands_positions_idx_[i].second); + "Exported position joint %d at command interface %d.", commands_positions_idx_[i].first, + commands_positions_idx_[i].second); } for (int i = 0u; i < commands_velocities_idx_.size(); i++) { RCLCPP_INFO( rclcpp::get_logger("CarlikeBotSystemHardware"), - "Exported velocity joint %d at command interface %d.", commands_velocities_idx_[i].first, commands_velocities_idx_[i].second); + "Exported velocity joint %d at command interface %d.", commands_velocities_idx_[i].first, + commands_velocities_idx_[i].second); } return command_interfaces; } @@ -271,7 +269,7 @@ hardware_interface::CallbackReturn CarlikeBotSystemHardware::on_activate( { rclcpp::sleep_for(std::chrono::seconds(1)); RCLCPP_INFO( - rclcpp::get_logger("CarlikeBotSystemHardware"), "%.1f seconds left...", hw_start_sec_ - i); + rclcpp::get_logger("CarlikeBotSystemHardware"), "%.1f seconds left...", hw_start_sec_ - i); } for (auto i = 0u; i < hw_positions_.size(); i++) @@ -340,16 +338,17 @@ hardware_interface::return_type ros2_control_demo_example_11 ::CarlikeBotSystemH for (auto i = 0u; i < hw_commands_.size(); i++) { RCLCPP_INFO( - rclcpp::get_logger("CarlikeBotSystemHardware"), "Got command %.5f for '%s'!", hw_commands_[i], - info_.joints[i].name.c_str()); - + rclcpp::get_logger("CarlikeBotSystemHardware"), "Got command %.5f for '%s'!", + hw_commands_[i], info_.joints[i].name.c_str()); } for (auto i = 0u; i < hw_commands_.size(); i++) { // Find the tuple in commands_counterpart_ that has the first value of it equal to i - auto it = std::find_if(commands_counterpart_.begin(), commands_counterpart_.end(), - [i](const std::tuple & element) { return std::get<0>(element) == i; }); + auto it = std::find_if( + commands_counterpart_.begin(), commands_counterpart_.end(), + [i](const std::tuple & element) + { return std::get<0>(element) == i; }); // Get the interface_type from the second value of the tuple std::string interface_type = std::get<1>(*it); @@ -367,19 +366,17 @@ hardware_interface::return_type ros2_control_demo_example_11 ::CarlikeBotSystemH } RCLCPP_INFO( - rclcpp::get_logger("CarlikeBotSystemHardware"), "Successfully written to joint %d of type %s!", i, interface_type.c_str()); - + rclcpp::get_logger("CarlikeBotSystemHardware"), + "Successfully written to joint %d of type %s!", i, interface_type.c_str()); } - - // for (auto it : hw_commands_) // { // RCLCPP_INFO( // rclcpp::get_logger("CarlikeBotSystemHardware"), "Got command %.5f for '%s'!", it.second, // it.first.c_str()); - // if + // if // if (it.first.find("steering") != std::string::npos) // { diff --git a/example_11/hardware/include/ros2_control_demo_example_11/carlikebot_system.hpp b/example_11/hardware/include/ros2_control_demo_example_11/carlikebot_system.hpp index e0ff4a51b..ed237553c 100644 --- a/example_11/hardware/include/ros2_control_demo_example_11/carlikebot_system.hpp +++ b/example_11/hardware/include/ros2_control_demo_example_11/carlikebot_system.hpp @@ -15,11 +15,11 @@ #ifndef ROS2_CONTROL_DEMO_EXAMPLE_11__CARLIKEBOT_SYSTEM_HPP_ #define ROS2_CONTROL_DEMO_EXAMPLE_11__CARLIKEBOT_SYSTEM_HPP_ +#include #include #include -#include -#include #include +#include #include "hardware_interface/handle.hpp" #include "hardware_interface/hardware_info.hpp" @@ -70,12 +70,11 @@ class CarlikeBotSystemHardware : public hardware_interface::SystemInterface private: // Parameter disnguishing between simulation and physical robot bool m_running_simulation; - + // Parameters for the CarlikeBot simulation double hw_start_sec_; double hw_stop_sec_; - // Store the command for the CarlikeBot robot std::vector hw_commands_; std::vector hw_positions_;