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.

189 lines
8.3KB

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