当前位置:   article > 正文

Gazebo + RViz + Moveit + ur5e机械臂仿真(环境搭建二)_rviz仿真机械臂

rviz仿真机械臂

【前言】本篇文章旨在实现,在gazebo添加摄像头模型以及二维码,以及实现机械臂点动及二维码跟踪。

一、主要步骤

【Gazebo仿真·二】Gazebo + ur5e + RealSense + Aruco 二维码识别与跟随仿真_使用realsense进行gazebo仿真-CSDN博客

二、部分问题解答

2.1 资源获取

链接: https://pan.baidu.com/s/1HGWTH70RynIQVyEwZCqnkQ?pwd=kr4w 提取码: kr4w

建议在Ubuntu中的火狐浏览器直接打开这个链接然后将文件下载下来,节省很多安装时间。但是这只是安装文件,有些插件仍需通过从终端输入指令下载。

我的arm_control中的代码和主要步骤中的链接有了较大改动,将笛卡尔空间规划更换为了关节空间规划。

关节空间的轨迹规划和笛卡尔空间的轨迹规划联系与区别_关节空间轨迹规划与笛卡尔轨迹规划的区别-CSDN博客

 2.2 运动学求解器替换

MoveIt! 学习笔记13 - KDL/IKFAST/TRAC-IK运动学求解器区别_moveit 提供了运动学求解器-CSDN博客
【IKFast】IKFast配置与使用-CSDN博客

如果只是作为大概了解可以将KDL更换为TRACC-IK。在使用主要步骤中arm_control中的arm_control的笛卡尔空间规划的成功率会有提升。但建议还是使用关节空间规划。

关节空间的轨迹规划和笛卡尔空间的轨迹规划联系与区别_关节空间轨迹规划与笛卡尔轨迹规划的区别-CSDN博客

2.3 二维码生成

Online ArUco markers generator (chev.me)中生成二维码时,要选择Original ArUco,并且确保生成的Marker ID和Marker size与设置中的相同。否则,将无法通过

rostopic echo /aruco_single/pose

识别到二维码的位置信息。

三、代码测试

3.1 常用代码总结
  1. roslaunch ur5e_moveit_config demo_gazebo.launch
  2. roslaunch aruco_ros demo.launch
  3. rostopic echo /aruco_single/pose
  4. rosrun image_view image_view image:=/aruco_single/result
  5. rosrun arm_control arm_control
  6. rosrun arm_control move_with_marker
3.2  arm_control 解读
  1. /**
  2. * 控制机械臂在关节空间进行移动,并输出移动前后的关节值
  3. **/
  4. #include <moveit/move_group_interface/move_group_interface.h>
  5. #include <moveit/planning_scene_interface/planning_scene_interface.h>
  6. #include <moveit_msgs/MoveItErrorCodes.h>
  7. #include <iostream>
  8. int main(int argc, char **argv)
  9. {
  10. ros::init(argc, argv, "arm_control"); // 初始化
  11. ros::NodeHandle node_handle;
  12. ros::AsyncSpinner spinner(1); // 多线程
  13. spinner.start(); // 开启新的线程
  14. moveit::planning_interface::MoveGroupInterface arm("arm"); // 初始化机械臂的arm group
  15. std::string end_effector_link = arm.getEndEffectorLink(); // 获取末端执行器的link名称
  16. std::cout << "End effector link: " << end_effector_link << std::endl;
  17. std::string reference_frame = "base_link"; // 设置目标位置所使用的参考坐标系
  18. arm.setPoseReferenceFrame(reference_frame);
  19. arm.allowReplanning(true); // 允许重新规划
  20. arm.setGoalJointTolerance(0.001);
  21. arm.setGoalPositionTolerance(0.001); // 设置位置和姿态的允许误差
  22. arm.setGoalOrientationTolerance(0.01);
  23. arm.setMaxAccelerationScalingFactor(0.2); // 设置最大加速度
  24. arm.setMaxVelocityScalingFactor(0.2); // 设置最大速度
  25. // 获取并输出机械臂当前的关节值
  26. std::vector<double> start_joint_values = arm.getCurrentJointValues();
  27. std::cout << "Start joint values: ";
  28. for (double joint_value : start_joint_values) {
  29. std::cout << joint_value << " ";
  30. }
  31. std::cout << std::endl;
  32. // 设置目标关节值
  33. std::vector<double> joint_group_variables;
  34. // 这里需要根据实际机械臂的关节空间和目标点位来设置关节值
  35. joint_group_variables.push_back(1.0);
  36. joint_group_variables.push_back(0.5);
  37. joint_group_variables.push_back(-0.5);
  38. joint_group_variables.push_back(1.0);
  39. joint_group_variables.push_back(0.0);
  40. joint_group_variables.push_back(0.0);
  41. // 设置关节目标
  42. arm.setJointValueTarget(joint_group_variables);
  43. // 规划路径
  44. moveit::planning_interface::MoveGroupInterface::Plan plan;
  45. moveit::core::MoveItErrorCode error_code = arm.plan(plan);
  46. if (error_code) {
  47. ROS_INFO("Joint space planning succeeded.");
  48. arm.execute(plan); // 执行规划的路径
  49. // 移动后的关节值
  50. std::vector<double> end_joint_values = arm.getCurrentJointValues();
  51. std::cout << "End joint values: ";
  52. for (double joint_value : end_joint_values) {
  53. std::cout << joint_value << " ";
  54. }
  55. std::cout << std::endl;
  56. }
  57. ros::shutdown();
  58. return 0;
  59. }

 这里使用笛卡尔空间的代码会更直观的帮助我们理解,但是使用关节空间会拥有更高的规划效率。

3.3  move_with_marker 解读 

程序的主要逻辑是:

  • 订阅标记位置信息。
  • 当标记位置发生变化时,更新机械臂的目标位置。
  • 规划机械臂到目标位置的路径。
  • 如果规划成功,执行路径;如果失败,重置目标位置为当前位置。
  • 检查机械臂是否到达目标位置,如果没有,重置目标位置。
  1. //问题:二次移动后,不变轴的数据会被赋予上次的数值(已解决)
  2. //问题:二次移动二维码后,不能规划(已解决)
  3. //问题:规划失败后,变量已被提前储存(已解决;规划失败,将变量定为当前数值)
  4. //问题:在已经完成跟踪后,仍然会不停校正位置,从而导致崩溃(已解决)
  5. //问题:在规划成功,但运动失败后,变量已被提前储存(已解决)
  6. //问题:路径规划结果不稳定(已解决)
  7. //目标:增加终端的信息输出(已解决)
  8. #include <ros/ros.h>
  9. #include <moveit/move_group_interface/move_group_interface.h>
  10. #include <geometry_msgs/PoseStamped.h>
  11. #include <iostream>
  12. class MoveToMarker
  13. {
  14. private:
  15. ros::NodeHandle nh_;
  16. ros::Subscriber sub_;
  17. moveit::planning_interface::MoveGroupInterface arm;
  18. geometry_msgs::Pose markerPose_; // 私有成员变量,存储目标位置和姿态
  19. geometry_msgs::Point compare; // 用于比较位置变化的私有成员变量
  20. public:
  21. bool ifMove;
  22. MoveToMarker(ros::NodeHandle n);
  23. ~MoveToMarker();
  24. void markerCb(const geometry_msgs::PoseStamped& pose);
  25. void moveOnce();
  26. };
  27. MoveToMarker::~MoveToMarker() {}
  28. MoveToMarker::MoveToMarker(ros::NodeHandle n): nh_(n), arm("arm")
  29. {
  30. this->nh_ = n;
  31. ifMove = false;
  32. std::string end_effector_link = arm.getEndEffectorLink();
  33. std::cout << "End effector link: " << end_effector_link << std::endl;
  34. // 初始化机械臂末端位置及姿态
  35. markerPose_.position.x = 0.1;
  36. markerPose_.position.y = 0.134;
  37. markerPose_.position.z = 0.98;
  38. markerPose_.orientation.x = 0.0;
  39. markerPose_.orientation.y = 0.707;
  40. markerPose_.orientation.z = 0.0;
  41. markerPose_.orientation.w = 0.707;
  42. // 初始化对比值
  43. compare.x = 0;
  44. compare.y = 0;
  45. compare.z = 0;
  46. ros::AsyncSpinner spinner(1);
  47. spinner.start();
  48. std::string reference_frame = "base_link";
  49. arm.setPoseReferenceFrame(reference_frame);
  50. arm.allowReplanning(true);
  51. arm.setGoalJointTolerance(0.001);
  52. arm.setGoalPositionTolerance(0.001);
  53. arm.setGoalOrientationTolerance(0.01);
  54. arm.setMaxAccelerationScalingFactor(0.2);
  55. arm.setMaxVelocityScalingFactor(0.2);
  56. geometry_msgs::Pose now_pose = arm.getCurrentPose(end_effector_link).pose;
  57. std::cout << "now Robot position: [x,y,z]: [" << now_pose.position.x << "," << now_pose.position.y << "," << now_pose.position.z << "]" << std::endl;
  58. std::cout << "now Robot orientation: [x,y,z,w]: [" << now_pose.orientation.x << "," << now_pose.orientation.y << "," << now_pose.orientation.z << "," << now_pose.orientation.w << "]" << std::endl;
  59. arm.setNamedTarget("init_pose"); // 控制机械臂先回到初始化位置
  60. arm.move();
  61. sleep(1);
  62. sub_ = n.subscribe("/aruco_single/pose", 1, &MoveToMarker::markerCb, this);
  63. }
  64. void MoveToMarker::markerCb(const geometry_msgs::PoseStamped& pose)
  65. {
  66. // 检查marker位置是否发生变化(通过对比和阈值,避免噪声的干扰)
  67. // 通过rostopic echo /aruco_single/pose得知,模拟环境噪声变化绝大多数小于0.01
  68. // 真实情况需要再次评估噪声
  69. double threshold = 0.05;
  70. bool position_changed =
  71. abs(compare.x - pose.pose.position.x) > threshold ||
  72. abs(compare.y - pose.pose.position.y) > threshold ||
  73. abs(compare.z - pose.pose.position.z) > threshold;
  74. if (position_changed) {
  75. // 位置发生了变化,更新markerPose_为当前机械臂末端的位置
  76. markerPose_.position.x += pose.pose.position.x;
  77. markerPose_.position.y += pose.pose.position.z - 0.8;
  78. markerPose_.position.z += -pose.pose.position.y;
  79. // 更新姿态信息,如果需要的话
  80. // markerPose_.orientation = pose.pose.orientation;
  81. // 更新对比数值
  82. compare.x = pose.pose.position.x;
  83. compare.y = pose.pose.position.y;
  84. compare.z = pose.pose.position.z;
  85. ifMove = true; // 设置标志,位置已变化,需要移动
  86. }
  87. else{
  88. ifMove = false; // 设置标志,位置未变化,不需要移动
  89. }
  90. }
  91. void MoveToMarker::moveOnce()
  92. {
  93. ros::AsyncSpinner spinner(1); // 多线程
  94. spinner.start(); // 开启新的线程
  95. // 直接输出目标位置和姿态
  96. std::cout << "target position: [x,y,z]: [" << markerPose_.position.x << "," << markerPose_.position.y << "," << markerPose_.position.z << "]" << std::endl;
  97. std::cout << "target orientation: [x,y,z,w]: [" << markerPose_.orientation.x << "," << markerPose_.orientation.y << "," << markerPose_.orientation.z << "," << markerPose_.orientation.w << "]" << std::endl;
  98. // 设置机械臂的目标位置和姿态
  99. arm.setPoseTarget(markerPose_);
  100. // 规划路径
  101. moveit::planning_interface::MoveGroupInterface::Plan plan;
  102. if (arm.plan(plan)) {
  103. // 输出执行前机械臂的目标位置
  104. std::cout << "Moving arm to target position: [x,y,z]: ["
  105. << markerPose_.position.x << ", "
  106. << markerPose_.position.y << ", "
  107. << markerPose_.position.z << "]" << std::endl;
  108. arm.execute(plan);
  109. ROS_INFO("Joint space planning succeeded.");
  110. // 执行规划的路径
  111. arm.execute(plan);
  112. // 检查机械臂是否到达目标位置
  113. geometry_msgs::Pose end_effector_pose = arm.getCurrentPose(arm.getEndEffectorLink()).pose;
  114. bool reached_target = std::abs(end_effector_pose.position.x - markerPose_.position.x) < 0.05 &&
  115. std::abs(end_effector_pose.position.y - markerPose_.position.y) < 0.05 &&
  116. std::abs(end_effector_pose.position.z - markerPose_.position.z) < 0.05;
  117. if (reached_target) {
  118. ROS_INFO("The arm has reached the target position.");
  119. }
  120. else {
  121. markerPose_.position = end_effector_pose.position;
  122. }
  123. ifMove = false; // 设置标志,已完成移动,不需要移动
  124. // 输出当前机械臂末端的位置
  125. std::cout << "Current end effector position: [x,y,z]: ["
  126. << end_effector_pose.position.x << ", "
  127. << end_effector_pose.position.y << ", "
  128. << end_effector_pose.position.z << "]" << std::endl;
  129. }
  130. else{
  131. ROS_INFO("Joint space planning failed. Resetting target pose to current end effector position.");
  132. ifMove = false;
  133. // 获取当前机械臂末端的位置
  134. geometry_msgs::Pose current_pose = arm.getCurrentPose(arm.getEndEffectorLink()).pose;
  135. if (std::abs(markerPose_.position.x - current_pose.position.x) > 0.05 &&
  136. std::abs(markerPose_.position.y - current_pose.position.y) > 0.05 &&
  137. std::abs(markerPose_.position.z - current_pose.position.z) > 0.05) {
  138. markerPose_.position = current_pose.position;
  139. }
  140. // 可以在这里添加代码来更新markerPose_.orientation为当前机械臂末端的姿态
  141. // markerPose_.orientation = current_pose.orientation;
  142. }
  143. }
  144. int main(int argc, char **argv)
  145. {
  146. ros::init(argc, argv, "move_with_marker_node");
  147. ros::NodeHandle n;
  148. MoveToMarker myMove(n);
  149. ros::WallDuration(5.0).sleep(); // 等待5秒
  150. while (ros::ok()) {
  151. ros::spinOnce();
  152. if (myMove.ifMove) {
  153. myMove.moveOnce();
  154. myMove.ifMove = false; // 重置标志,避免重复移动
  155. }
  156. ros::Duration(0.2).sleep();
  157. }
  158. return 0;
  159. }

通过不断在gazebo中进行测试,可以发现很多问题。通过分析在什么情况下,会出现不理想的运动,来改善代码。(这里的代码和网盘资源里的move_with_marker比,有一些小的改进)

3.4 路径规划

在catkin_ws/src/robot_gazebo/ur5e_moveit_config/ompl_planning.yaml中更换路径规划器,将RRT换为RRTConnect或者RRTstar(RRT*)

3.5 二次优化代码
  1. //问题:二次移动后,不变轴的数据会被赋予上次的数值(已解决)
  2. //问题:二次移动二维码后,不能规划(已解决)
  3. //问题:规划失败后,变量已被提前储存(已解决;规划失败,将变量定为当前数值)
  4. //问题:在已经完成跟踪后,仍然会不停校正位置,从而导致崩溃(已解决)
  5. //问题:在规划成功,但运动失败后,变量已被提前储存(已解决)
  6. //问题:路径规划结果不稳定(已解决)
  7. //问题:姿态规划算法不正确(未解决)
  8. //目标:增加终端的信息输出(已完成)
  9. //目标:增加位置跟踪功能(已完成)
  10. //目标:增加姿态跟踪功能(未完成)
  11. #include <ros/ros.h>
  12. #include <moveit/move_group_interface/move_group_interface.h>
  13. #include <geometry_msgs/PoseStamped.h>
  14. #include <iostream>
  15. class MoveToMarker
  16. {
  17. private:
  18. ros::NodeHandle nh_;
  19. ros::Subscriber sub_;
  20. moveit::planning_interface::MoveGroupInterface arm;
  21. geometry_msgs::Pose markerPose_; // 私有成员变量,存储目标位置和姿态
  22. geometry_msgs::Point compare; // 用于比较位置变化的私有成员变量
  23. public:
  24. bool ifMove;
  25. MoveToMarker(ros::NodeHandle n);
  26. ~MoveToMarker();
  27. void markerCb(const geometry_msgs::PoseStamped& pose);
  28. void moveOnce();
  29. };
  30. MoveToMarker::~MoveToMarker() {}
  31. MoveToMarker::MoveToMarker(ros::NodeHandle n): nh_(n), arm("arm")
  32. {
  33. this->nh_ = n;
  34. ifMove = false;
  35. std::string end_effector_link = arm.getEndEffectorLink();
  36. std::cout << "End effector link: " << end_effector_link << std::endl;
  37. // 初始化机械臂末端位置及姿态
  38. markerPose_.position.x = 0.1;
  39. markerPose_.position.y = 0.134;
  40. markerPose_.position.z = 0.98;
  41. markerPose_.orientation.x = 0.0;
  42. markerPose_.orientation.y = 0.707;
  43. markerPose_.orientation.z = 0.0;
  44. markerPose_.orientation.w = 0.707;
  45. // 初始化对比值
  46. compare.x = 0;
  47. compare.y = 0;
  48. compare.z = 0;
  49. ros::AsyncSpinner spinner(1);
  50. spinner.start();
  51. std::string reference_frame = "base_link";
  52. arm.setPoseReferenceFrame(reference_frame);
  53. arm.allowReplanning(true);
  54. arm.setGoalJointTolerance(0.001);
  55. arm.setGoalPositionTolerance(0.001);
  56. arm.setGoalOrientationTolerance(0.01);
  57. arm.setMaxAccelerationScalingFactor(0.2);
  58. arm.setMaxVelocityScalingFactor(0.2);
  59. geometry_msgs::Pose now_pose = arm.getCurrentPose(end_effector_link).pose;
  60. std::cout << "now Robot position: [x,y,z]: [" << now_pose.position.x << "," << now_pose.position.y << "," << now_pose.position.z << "]" << std::endl;
  61. std::cout << "now Robot orientation: [x,y,z,w]: [" << now_pose.orientation.x << "," << now_pose.orientation.y << "," << now_pose.orientation.z << "," << now_pose.orientation.w << "]" << std::endl;
  62. arm.setNamedTarget("init_pose"); // 控制机械臂先回到初始化位置
  63. arm.move();
  64. sleep(1);
  65. sub_ = n.subscribe("/aruco_single/pose", 1, &MoveToMarker::markerCb, this);
  66. }
  67. void MoveToMarker::markerCb(const geometry_msgs::PoseStamped& pose)
  68. {
  69. // 检查marker位置是否发生变化(通过对比和阈值,避免噪声的干扰)
  70. // 通过rostopic echo /aruco_single/pose得知,模拟环境噪声变化绝大多数小于0.01
  71. // 真实情况需要再次评估噪声
  72. double threshold = 0.05;
  73. bool position_changed =
  74. abs(compare.x - pose.pose.position.x) > threshold ||
  75. abs(compare.y - pose.pose.position.y) > threshold ||
  76. abs(compare.z - pose.pose.position.z) > threshold;
  77. if (position_changed) {
  78. // 位置发生了变化,更新markerPose_为当前机械臂末端的位置
  79. double pose_offset = 0.8;
  80. markerPose_.position.x += pose.pose.position.x;
  81. markerPose_.position.y += pose.pose.position.z - pose_offset;
  82. markerPose_.position.z += -pose.pose.position.y;
  83. // 更新对比数值
  84. compare.x = pose.pose.position.x;
  85. compare.y = pose.pose.position.y;
  86. compare.z = pose.pose.position.z;
  87. ifMove = true; // 设置标志,位置已变化,需要移动
  88. }
  89. else{
  90. ifMove = false; // 设置标志,位置未变化,不需要移动
  91. }
  92. }
  93. void MoveToMarker::moveOnce()
  94. {
  95. ros::AsyncSpinner spinner(1); // 多线程
  96. spinner.start(); // 开启新的线程
  97. // 直接输出目标位置和姿态
  98. std::cout << "target position: [x,y,z]: [" << markerPose_.position.x << "," << markerPose_.position.y << "," << markerPose_.position.z << "]" << std::endl;
  99. std::cout << "target orientation: [x,y,z,w]: [" << markerPose_.orientation.x << "," << markerPose_.orientation.y << "," << markerPose_.orientation.z << "," << markerPose_.orientation.w << "]" << std::endl;
  100. // 设置机械臂的目标位置和姿态
  101. arm.setPoseTarget(markerPose_);
  102. // 规划路径
  103. moveit::planning_interface::MoveGroupInterface::Plan plan;
  104. if (arm.plan(plan)) {
  105. // 输出执行前机械臂的目标位置
  106. std::cout << "Moving arm to target position: [x,y,z]: ["
  107. << markerPose_.position.x << ", "
  108. << markerPose_.position.y << ", "
  109. << markerPose_.position.z << "]" << std::endl;
  110. if (markerPose_.position.z < 0.23) {
  111. ROS_WARN("The target position is too low: [x,y,z]: [%f, %f, %f]", markerPose_.position.x, markerPose_.position.y, markerPose_.position.z);
  112. // 这里可以根据需要添加其他逻辑,例如调整目标位置或取消移动
  113. // 如果目标位置太低,则不执行移动
  114. arm.setNamedTarget("init_pose"); // 控制机械臂先回到初始化位置
  115. arm.move();
  116. ROS_INFO("Moved back to initial position.");
  117. ifMove = false;
  118. return; // 退出函数,取消移动
  119. }
  120. ROS_INFO("Joint space planning succeeded.");
  121. // 执行规划的路径
  122. arm.execute(plan);
  123. // 检查机械臂是否到达目标位置
  124. geometry_msgs::Pose end_effector_pose = arm.getCurrentPose(arm.getEndEffectorLink()).pose;
  125. bool reached_target = std::abs(end_effector_pose.position.x - markerPose_.position.x) < 0.05 &&
  126. std::abs(end_effector_pose.position.y - markerPose_.position.y) < 0.05 &&
  127. std::abs(end_effector_pose.position.z - markerPose_.position.z) < 0.05;
  128. if (reached_target) {
  129. ROS_INFO("The arm has reached the target position.");
  130. ifMove = false; // 设置标志,已完成移动,不需要移动
  131. }
  132. else {
  133. // ! 这里会二次运行
  134. // 输出当前机械臂末端的位置
  135. std::cout << "Current end effector position: [x,y,z]: ["
  136. << end_effector_pose.position.x << ", "
  137. << end_effector_pose.position.y << ", "
  138. << end_effector_pose.position.z << "]" << std::endl;
  139. markerPose_.position = end_effector_pose.position;
  140. }
  141. }
  142. else{
  143. ROS_INFO("Joint space planning failed. Resetting target pose to current end effector position.");
  144. ifMove = false;
  145. // 获取当前机械臂末端的位置
  146. geometry_msgs::Pose current_pose = arm.getCurrentPose(arm.getEndEffectorLink()).pose;
  147. if (std::abs(markerPose_.position.x - current_pose.position.x) > 0.05 &&
  148. std::abs(markerPose_.position.y - current_pose.position.y) > 0.05 &&
  149. std::abs(markerPose_.position.z - current_pose.position.z) > 0.05) {
  150. markerPose_.position = current_pose.position;
  151. }
  152. }
  153. }
  154. int main(int argc, char **argv)
  155. {
  156. ros::init(argc, argv, "move_with_marker_node");
  157. ros::NodeHandle n;
  158. MoveToMarker myMove(n);
  159. ros::WallDuration(2.0).sleep(); // 等待2
  160. while (ros::ok()) {
  161. ros::spinOnce();
  162. if (myMove.ifMove) {
  163. myMove.moveOnce();
  164. myMove.ifMove = false; // 重置标志,避免重复移动
  165. }
  166. ros::Duration(0.2).sleep();
  167. }
  168. return 0;
  169. }
四、 项目总结
 4.1 致学习者

总的来说,这个项目可以作为一个关于ROS和机械臂的入门级项目,对机器人感兴趣或者想要判断未来是否要学习相关领域的同学可以尝试一下。

4.2 未来改进
  • 添加防止碰撞地面功能。(已完成,末端过低,返回初始位置)
  • 完善终端输出的反馈,改善使用体验。(已完成)
  • 添加姿态跟踪的功能,全面实现机械臂跟踪的功能。
声明:本文内容由网友自发贡献,不代表【wpsshop博客】立场,版权归原作者所有,本站不承担相应法律责任。如您发现有侵权的内容,请联系我们。转载请注明出处:https://www.wpsshop.cn/w/喵喵爱编程/article/detail/818751
推荐阅读
  

闽ICP备14008679号