ROS Components for hexapod_robot
You can not select more than 25 topics Topics must start with a letter or number, can include dashes ('-') and can be up to 35 characters long.

213 lines
9.5KB

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