Unified hexapod repository, containing all modules
Vous ne pouvez pas sélectionner plus de 25 sujets Les noms de sujets doivent commencer par une lettre ou un nombre, peuvent contenir des tirets ('-') et peuvent comporter jusqu'à 35 caractères.

214 lignes
9.7KB

  1. #include "hexapod_robot/hexapod_robot_hwi.hpp"
  2. #include "hardware_interface/types/hardware_interface_type_values.hpp"
  3. #include "rclcpp/rclcpp.hpp"
  4. #include <fcntl.h>
  5. #include <unistd.h>
  6. #include <stdlib.h>
  7. #include <stdio.h>
  8. #include <fcntl.h>
  9. #include <stdint.h>
  10. #include <sys/ioctl.h>
  11. #include <linux/i2c-dev.h>
  12. extern "C" {
  13. #include <i2c/smbus.h>
  14. }
  15. namespace hexapod_robot {
  16. HexapodRobotHardwareInterface::~HexapodRobotHardwareInterface() {
  17. on_deactivate(rclcpp_lifecycle::State());
  18. }
  19. hardware_interface::CallbackReturn
  20. HexapodRobotHardwareInterface::on_init(const hardware_interface::HardwareInfo &info) {
  21. if (hardware_interface::SystemInterface::on_init(info) != hardware_interface::CallbackReturn::SUCCESS) {
  22. return hardware_interface::CallbackReturn::ERROR;
  23. }
  24. RCLCPP_INFO(rclcpp::get_logger("HexapodRobotHardwareInterface"), "on_init");
  25. servos_powered_ = false;
  26. for (const hardware_interface::ComponentInfo &joint: info_.joints) {
  27. std::string i2c_address_parameter = joint.name + "_i2c_address";
  28. std::string channel_parameter = joint.name + "_channel";
  29. std::string counts_intersect_parameter = joint.name + "_counts_intersect";
  30. std::string counts_slope_parameter = joint.name + "_counts_slope";
  31. std::string counts_min_parameter = joint.name + "_counts_min";
  32. std::string counts_max_parameter = joint.name + "_counts_max";
  33. std::string startup_value_parameter = joint.name + "_startup_value";
  34. PWMOutput pwm_output;
  35. pwm_output.i2c_address = stoi(info_.hardware_parameters[i2c_address_parameter], nullptr, 0);
  36. pwm_output.channel = stoi(info_.hardware_parameters[channel_parameter], nullptr, 0);
  37. pwm_output.counts_intersect = stod(info_.hardware_parameters[counts_intersect_parameter]);
  38. pwm_output.counts_slope = stod(info_.hardware_parameters[counts_slope_parameter]);
  39. pwm_output.counts_min = stod(info_.hardware_parameters[counts_min_parameter]);
  40. pwm_output.counts_max = stod(info_.hardware_parameters[counts_max_parameter]);
  41. joint_commands_[joint.name] = stod(info_.hardware_parameters[startup_value_parameter]);
  42. pca_available_[pwm_output.i2c_address] = false;
  43. joint_pwm_mapping_[joint.name] = pwm_output;
  44. RCLCPP_INFO(rclcpp::get_logger("HexapodRobotHardwareInterface"), "%s mapped to 0x%02x:%d. intersect: %.4f slope: %.4f", joint.name.c_str(), pwm_output.i2c_address, pwm_output.channel, pwm_output.counts_intersect, pwm_output.counts_slope);
  45. }
  46. i2c_available_ = i2c_open_(info_.hardware_parameters["i2c_device"]);
  47. if(i2c_available_) pca_initialize_();
  48. return hardware_interface::CallbackReturn::SUCCESS;
  49. }
  50. bool
  51. HexapodRobotHardwareInterface::i2c_open_(const std::string& device) {
  52. i2c_fd_ = open(device.c_str(), O_RDWR);
  53. if (i2c_fd_ < 0) {
  54. RCLCPP_WARN(rclcpp::get_logger("HexapodRobotHardwareInterface"), "Cannot open %s, continuing in dummy mode.", info_.hardware_parameters["i2c_device"].c_str());
  55. return false;
  56. }
  57. return true;
  58. }
  59. void
  60. HexapodRobotHardwareInterface::pca_initialize_() {
  61. for (const auto& [i2c_address, available]: pca_available_) {
  62. ioctl(i2c_fd_, I2C_SLAVE, i2c_address);
  63. if(i2c_smbus_write_byte_data(i2c_fd_, pca_reg_mode1_, 0x00) < 0) {
  64. RCLCPP_WARN(rclcpp::get_logger("HexapodRobotHardwareInterface"), "Could not open i2c device %02x, marking as unavailable.", i2c_address);
  65. pca_available_[i2c_address] = false;
  66. } else {
  67. i2c_smbus_write_byte_data(i2c_fd_, pca_reg_mode1_, pca_mode1_sleep_);
  68. i2c_smbus_write_byte_data(i2c_fd_, pca_reg_mode2_, pca_mode2_outdrv_);
  69. i2c_smbus_write_byte_data(i2c_fd_, pca_reg_prescale_, (uint8_t)pca_prescaler_value_);
  70. i2c_smbus_write_byte_data(i2c_fd_, pca_reg_mode1_, pca_mode1_restart_);
  71. RCLCPP_INFO(rclcpp::get_logger("HexapodRobotHardwareInterface"), "PCA9685 at i2c 0x%02x initialized.", i2c_address);
  72. pca_available_[i2c_address] = true;
  73. }
  74. }
  75. }
  76. bool
  77. HexapodRobotHardwareInterface::pca_set_pwm_(uint8_t i2c_address, uint8_t channel_number, uint16_t counts) {
  78. // if(i2c_address == 0x40 && channel_number == 0) {
  79. // RCLCPP_INFO(rclcpp::get_logger("HexapodRobotHardwareInterface"), "pca_set_pwm(%02x, %02x, %04x)", i2c_address, channel_number, counts);
  80. // }
  81. if(channel_number>15) {
  82. RCLCPP_WARN(rclcpp::get_logger("HexapodRobotHardwareInterface"), "pca_set_pwm: channel %02x >15", channel_number);
  83. return false;
  84. }
  85. if(counts > 0x1000) {
  86. RCLCPP_WARN(rclcpp::get_logger("HexapodRobotHardwareInterface"), "pca_set_pwm: counts %04x >15", counts);
  87. return false;
  88. }
  89. if(!pca_available_[i2c_address]) {
  90. // RCLCPP_WARN(rclcpp::get_logger("HexapodRobotHardwareInterface"), "pca_set_pwm: i2c_address %02x unavailable.", i2c_address);
  91. return false;
  92. }
  93. if(ioctl(i2c_fd_, I2C_SLAVE, i2c_address) < 0) {
  94. RCLCPP_WARN(rclcpp::get_logger("HexapodRobotHardwareInterface"), "pca_set_pwm: ioctl failed.");
  95. return false;
  96. }
  97. // adding channel_number * 4 to the base address for LED0 output given by the constants
  98. // yields the addresses of all PWM channels
  99. if(counts == 0) {
  100. // output always off
  101. i2c_smbus_write_byte_data(i2c_fd_, pca_reg_led_on_l_ + channel_number * 4, 0x00); // ON_L
  102. i2c_smbus_write_byte_data(i2c_fd_, pca_reg_led_on_h_ + channel_number * 4, 0x00); // ON_H
  103. i2c_smbus_write_byte_data(i2c_fd_, pca_reg_led_off_l_ + channel_number * 4, 0x00); // OFF_L
  104. i2c_smbus_write_byte_data(i2c_fd_, pca_reg_led_off_h_ + channel_number * 4, 0x10); // OFF_H == 0x10 => LED full OFF
  105. } else if(counts == 0x1000) {
  106. // output always on
  107. i2c_smbus_write_byte_data(i2c_fd_, pca_reg_led_on_l_ + channel_number * 4, 0x00); // ON_L
  108. i2c_smbus_write_byte_data(i2c_fd_, pca_reg_led_on_h_ + channel_number * 4, 0x10); // ON_H == 0x10 => LED full ON
  109. i2c_smbus_write_byte_data(i2c_fd_, pca_reg_led_off_l_ + channel_number * 4, 0x00); // OFF_L
  110. i2c_smbus_write_byte_data(i2c_fd_, pca_reg_led_off_h_ + channel_number * 4, 0x00); // OFF_H
  111. } else {
  112. // duty cycle from 0 to counts
  113. i2c_smbus_write_byte_data(i2c_fd_, pca_reg_led_on_h_ + channel_number * 4, 0x00);
  114. i2c_smbus_write_byte_data(i2c_fd_, pca_reg_led_on_l_ + channel_number * 4, 0x00);
  115. i2c_smbus_write_byte_data(i2c_fd_, pca_reg_led_off_l_ + channel_number * 4, counts & 0xff); // lower byte
  116. i2c_smbus_write_byte_data(i2c_fd_, pca_reg_led_off_h_ + channel_number * 4, counts >> 8); // shift upper byte into lower byte
  117. }
  118. return true;
  119. }
  120. hardware_interface::CallbackReturn
  121. HexapodRobotHardwareInterface::on_activate(const rclcpp_lifecycle::State &) {
  122. RCLCPP_INFO(rclcpp::get_logger("HexapodRobotHardwareInterface"), "on_activate");
  123. servos_powered_ = true;
  124. return hardware_interface::CallbackReturn::SUCCESS;
  125. }
  126. hardware_interface::CallbackReturn
  127. HexapodRobotHardwareInterface::on_deactivate(const rclcpp_lifecycle::State &) {
  128. RCLCPP_INFO(rclcpp::get_logger("HexapodRobotHardwareInterface"), "on_deactivate");
  129. servos_powered_ = false;
  130. write(rclcpp::Time(), rclcpp::Duration(std::chrono::nanoseconds(0)));
  131. return hardware_interface::CallbackReturn::SUCCESS;
  132. }
  133. std::vector<hardware_interface::StateInterface>
  134. HexapodRobotHardwareInterface::export_state_interfaces() {
  135. std::vector<hardware_interface::StateInterface> state_interfaces;
  136. for (const hardware_interface::ComponentInfo &joint: info_.joints) {
  137. state_interfaces.emplace_back(hardware_interface::StateInterface(joint.name, hardware_interface::HW_IF_POSITION, &joint_commands_[joint.name]));
  138. }
  139. return state_interfaces;
  140. }
  141. std::vector<hardware_interface::CommandInterface>
  142. HexapodRobotHardwareInterface::export_command_interfaces() {
  143. std::vector<hardware_interface::CommandInterface> command_interfaces;
  144. for (const hardware_interface::ComponentInfo &joint: info_.joints) {
  145. command_interfaces.emplace_back(hardware_interface::CommandInterface(joint.name, hardware_interface::HW_IF_POSITION, &joint_commands_[joint.name]));
  146. }
  147. return command_interfaces;
  148. }
  149. hardware_interface::return_type
  150. HexapodRobotHardwareInterface::read(const rclcpp::Time &, const rclcpp::Duration &) {
  151. return hardware_interface::return_type::OK;
  152. }
  153. hardware_interface::return_type
  154. HexapodRobotHardwareInterface::write(const rclcpp::Time &, const rclcpp::Duration &) {
  155. for (const hardware_interface::ComponentInfo &joint: info_.joints) {
  156. const PWMOutput &pwm_output = joint_pwm_mapping_[joint.name];
  157. if(servos_powered_) {
  158. double pwm_value = pwm_output.counts_intersect + joint_commands_[joint.name] * pwm_output.counts_slope;
  159. if(pwm_value < pwm_output.counts_min) {
  160. RCLCPP_INFO(rclcpp::get_logger("HexapodRobotHardwareInterface"), "write: pwm_value %.2f too low, clipped to %.2f", pwm_value, pwm_output.counts_min);
  161. pwm_value = pwm_output.counts_min;
  162. }
  163. if(pwm_value > pwm_output.counts_max) {
  164. RCLCPP_INFO(rclcpp::get_logger("HexapodRobotHardwareInterface"), "write: pwm_value %.2f too high, clipped to %.2f", pwm_value, pwm_output.counts_max);
  165. pwm_value = pwm_output.counts_max;
  166. }
  167. pca_set_pwm_(pwm_output.i2c_address, pwm_output.channel, (uint16_t)pwm_value);
  168. } else {
  169. pca_set_pwm_(pwm_output.i2c_address, pwm_output.channel, 0);
  170. }
  171. }
  172. return hardware_interface::return_type::OK;
  173. }
  174. } // namespace
  175. #include "pluginlib/class_list_macros.hpp"
  176. PLUGINLIB_EXPORT_CLASS(hexapod_robot::HexapodRobotHardwareInterface, hardware_interface::SystemInterface)