ros-industrial / motoman

ROS-Industrial Motoman support (http://wiki.ros.org/motoman)
145 stars 192 forks source link

SDA10F doesn't move when executing trajectories #398

Closed pablomalvido closed 3 years ago

pablomalvido commented 3 years ago

Hello,

I am working with a SDA10F robot with a FS100 controller and I am having problems for moving the real robot through ROS. This is the information about my system:

I have followed the tutorials in http://wiki.ros.org/motoman_driver/Tutorials for installing the ROS server in the controller (first) and for commanding the robot using ROS (second tutorial). I have installed MotoROS using binaries (MotoRosFS_v192.out) and the MD5 hash is exactly the same as the one in the tutorial. I have noticed that my problem is very similar to the one in #343 , where the problem was in the INIT_ROS job. In my case I directly copy-pasted the job in https://github.com/ros-industrial/motoman/blob/kinetic-devel/motoman_driver/Inform/DX200%2C%20FS100%2C%20YRC1000/sda_dual_arm/INIT_ROS.JBI in the controller using a USB, following the tutorial steps, however as you can see in the picture below, when I open the JOB in the pendant I cannot see the first lines, it starts from the NOP line. I don't know if this could be a problem, so I just let you know.

image

I downloaded the Motoman package from https://github.com/ros-industrial/motoman and followed all the instructions in the README file for the installation.

Now I will describe the steps followed for moving the robot and the obtained error:

... logging to /home/remodel/.ros/log/722e710c-8e25-11eb-92b3-98fa9b9c7ffc/roslaunch-remodel-TAU-15030.log
Checking log directory for disk usage. This may take a while.
Press Ctrl-C to interrupt
Done checking log file disk usage. Usage is <1GB.

xacro: in-order processing became default in ROS Melodic. You can drop the option.
started roslaunch server http://remodel-TAU:42329/

SUMMARY
========

PARAMETERS
 * /controller_joint_names: ['arm_left_joint_...
 * /mongo_wrapper_ros_remodel_TAU_15030_8803950497284364922/database_path: /home/remodel/cat...
 * /mongo_wrapper_ros_remodel_TAU_15030_8803950497284364922/overwrite: False
 * /move_group/allow_trajectory_execution: True
 * /move_group/allowed_execution_duration_scaling: 1.2
 * /move_group/allowed_goal_duration_margin: 0.5
 * /move_group/arm_left/longest_valid_segment_fraction: 0.05
 * /move_group/arm_left/planner_configs: ['SBLkConfigDefau...
 * /move_group/arm_left/projection_evaluator: joints(arm_left_j...
 * /move_group/arm_right/longest_valid_segment_fraction: 0.05
 * /move_group/arm_right/planner_configs: ['SBLkConfigDefau...
 * /move_group/arm_right/projection_evaluator: joints(arm_right_...
 * /move_group/arms/longest_valid_segment_fraction: 0.05
 * /move_group/arms/planner_configs: ['SBLkConfigDefau...
 * /move_group/arms/projection_evaluator: joints(arm_left_j...
 * /move_group/capabilities: move_group/MoveGr...
 * /move_group/controller_list: [{'action_ns': 'j...
 * /move_group/jiggle_fraction: 0.05
 * /move_group/max_range: 5.0
 * /move_group/max_safe_path_cost: 1
 * /move_group/moveit_controller_manager: moveit_simple_con...
 * /move_group/moveit_manage_controllers: True
 * /move_group/octomap_resolution: 0.025
 * /move_group/planner_configs/BKPIECEkConfigDefault/type: geometric::BKPIECE
 * /move_group/planner_configs/ESTkConfigDefault/type: geometric::EST
 * /move_group/planner_configs/KPIECEkConfigDefault/type: geometric::KPIECE
 * /move_group/planner_configs/LBKPIECEkConfigDefault/type: geometric::LBKPIECE
 * /move_group/planner_configs/PRMkConfigDefault/type: geometric::PRM
 * /move_group/planner_configs/PRMstarkConfigDefault/type: geometric::PRMstar
 * /move_group/planner_configs/RRTConnectkConfigDefault/type: geometric::RRTCon...
 * /move_group/planner_configs/RRTkConfigDefault/type: geometric::RRT
 * /move_group/planner_configs/RRTstarkConfigDefault/type: geometric::RRTstar
 * /move_group/planner_configs/SBLkConfigDefault/type: geometric::SBL
 * /move_group/planner_configs/TRRTkConfigDefault/type: geometric::TRRT
 * /move_group/planning_plugin: ompl_interface/OM...
 * /move_group/planning_scene_monitor/publish_geometry_updates: True
 * /move_group/planning_scene_monitor/publish_planning_scene: True
 * /move_group/planning_scene_monitor/publish_state_updates: True
 * /move_group/planning_scene_monitor/publish_transforms_updates: True
 * /move_group/request_adapters: default_planner_r...
 * /move_group/sda10f/longest_valid_segment_fraction: 0.05
 * /move_group/sda10f/planner_configs: ['SBLkConfigDefau...
 * /move_group/sda10f/projection_evaluator: joints(torso_join...
 * /move_group/start_state_max_bounds_error: 0.1
 * /move_group/torso/longest_valid_segment_fraction: 0.05
 * /move_group/torso/planner_configs: ['SBLkConfigDefau...
 * /move_group/torso/projection_evaluator: joints(torso_join...
 * /robot_description: <?xml version="1....
 * /robot_description_kinematics/arm_left/kinematics_solver: kdl_kinematics_pl...
 * /robot_description_kinematics/arm_left/kinematics_solver_search_resolution: 0.005
 * /robot_description_kinematics/arm_left/kinematics_solver_timeout: 0.005
 * /robot_description_kinematics/arm_right/kinematics_solver: kdl_kinematics_pl...
 * /robot_description_kinematics/arm_right/kinematics_solver_search_resolution: 0.005
 * /robot_description_kinematics/arm_right/kinematics_solver_timeout: 0.005
 * /robot_description_kinematics/arms/kinematics_solver: kdl_kinematics_pl...
 * /robot_description_kinematics/arms/kinematics_solver_search_resolution: 0.005
 * /robot_description_kinematics/arms/kinematics_solver_timeout: 0.005
 * /robot_description_kinematics/sda10f/kinematics_solver: kdl_kinematics_pl...
 * /robot_description_kinematics/sda10f/kinematics_solver_search_resolution: 0.005
 * /robot_description_kinematics/sda10f/kinematics_solver_timeout: 0.005
 * /robot_description_kinematics/torso/kinematics_solver: kdl_kinematics_pl...
 * /robot_description_kinematics/torso/kinematics_solver_search_resolution: 0.005
 * /robot_description_kinematics/torso/kinematics_solver_timeout: 0.005
 * /robot_description_planning/joint_limits/arm_left_joint_1_s/has_acceleration_limits: False
 * /robot_description_planning/joint_limits/arm_left_joint_1_s/has_velocity_limits: True
 * /robot_description_planning/joint_limits/arm_left_joint_1_s/max_acceleration: 0
 * /robot_description_planning/joint_limits/arm_left_joint_1_s/max_velocity: 2.95
 * /robot_description_planning/joint_limits/arm_left_joint_2_l/has_acceleration_limits: False
 * /robot_description_planning/joint_limits/arm_left_joint_2_l/has_velocity_limits: True
 * /robot_description_planning/joint_limits/arm_left_joint_2_l/max_acceleration: 0
 * /robot_description_planning/joint_limits/arm_left_joint_2_l/max_velocity: 2.95
 * /robot_description_planning/joint_limits/arm_left_joint_3_e/has_acceleration_limits: False
 * /robot_description_planning/joint_limits/arm_left_joint_3_e/has_velocity_limits: True
 * /robot_description_planning/joint_limits/arm_left_joint_3_e/max_acceleration: 0
 * /robot_description_planning/joint_limits/arm_left_joint_3_e/max_velocity: 2.95
 * /robot_description_planning/joint_limits/arm_left_joint_4_u/has_acceleration_limits: False
 * /robot_description_planning/joint_limits/arm_left_joint_4_u/has_velocity_limits: True
 * /robot_description_planning/joint_limits/arm_left_joint_4_u/max_acceleration: 0
 * /robot_description_planning/joint_limits/arm_left_joint_4_u/max_velocity: 2.95
 * /robot_description_planning/joint_limits/arm_left_joint_5_r/has_acceleration_limits: False
 * /robot_description_planning/joint_limits/arm_left_joint_5_r/has_velocity_limits: True
 * /robot_description_planning/joint_limits/arm_left_joint_5_r/max_acceleration: 0
 * /robot_description_planning/joint_limits/arm_left_joint_5_r/max_velocity: 3.48
 * /robot_description_planning/joint_limits/arm_left_joint_6_b/has_acceleration_limits: False
 * /robot_description_planning/joint_limits/arm_left_joint_6_b/has_velocity_limits: True
 * /robot_description_planning/joint_limits/arm_left_joint_6_b/max_acceleration: 0
 * /robot_description_planning/joint_limits/arm_left_joint_6_b/max_velocity: 3.48
 * /robot_description_planning/joint_limits/arm_left_joint_7_t/has_acceleration_limits: False
 * /robot_description_planning/joint_limits/arm_left_joint_7_t/has_velocity_limits: True
 * /robot_description_planning/joint_limits/arm_left_joint_7_t/max_acceleration: 0
 * /robot_description_planning/joint_limits/arm_left_joint_7_t/max_velocity: 6.97
 * /robot_description_planning/joint_limits/arm_right_joint_1_s/has_acceleration_limits: False
 * /robot_description_planning/joint_limits/arm_right_joint_1_s/has_velocity_limits: True
 * /robot_description_planning/joint_limits/arm_right_joint_1_s/max_acceleration: 0
 * /robot_description_planning/joint_limits/arm_right_joint_1_s/max_velocity: 2.95
 * /robot_description_planning/joint_limits/arm_right_joint_2_l/has_acceleration_limits: False
 * /robot_description_planning/joint_limits/arm_right_joint_2_l/has_velocity_limits: True
 * /robot_description_planning/joint_limits/arm_right_joint_2_l/max_acceleration: 0
 * /robot_description_planning/joint_limits/arm_right_joint_2_l/max_velocity: 2.95
 * /robot_description_planning/joint_limits/arm_right_joint_3_e/has_acceleration_limits: False
 * /robot_description_planning/joint_limits/arm_right_joint_3_e/has_velocity_limits: True
 * /robot_description_planning/joint_limits/arm_right_joint_3_e/max_acceleration: 0
 * /robot_description_planning/joint_limits/arm_right_joint_3_e/max_velocity: 2.95
 * /robot_description_planning/joint_limits/arm_right_joint_4_u/has_acceleration_limits: False
 * /robot_description_planning/joint_limits/arm_right_joint_4_u/has_velocity_limits: True
 * /robot_description_planning/joint_limits/arm_right_joint_4_u/max_acceleration: 0
 * /robot_description_planning/joint_limits/arm_right_joint_4_u/max_velocity: 2.95
 * /robot_description_planning/joint_limits/arm_right_joint_5_r/has_acceleration_limits: False
 * /robot_description_planning/joint_limits/arm_right_joint_5_r/has_velocity_limits: True
 * /robot_description_planning/joint_limits/arm_right_joint_5_r/max_acceleration: 0
 * /robot_description_planning/joint_limits/arm_right_joint_5_r/max_velocity: 3.48
 * /robot_description_planning/joint_limits/arm_right_joint_6_b/has_acceleration_limits: False
 * /robot_description_planning/joint_limits/arm_right_joint_6_b/has_velocity_limits: True
 * /robot_description_planning/joint_limits/arm_right_joint_6_b/max_acceleration: 0
 * /robot_description_planning/joint_limits/arm_right_joint_6_b/max_velocity: 3.48
 * /robot_description_planning/joint_limits/arm_right_joint_7_t/has_acceleration_limits: False
 * /robot_description_planning/joint_limits/arm_right_joint_7_t/has_velocity_limits: True
 * /robot_description_planning/joint_limits/arm_right_joint_7_t/max_acceleration: 0
 * /robot_description_planning/joint_limits/arm_right_joint_7_t/max_velocity: 6.97
 * /robot_description_planning/joint_limits/torso_joint_b1/has_acceleration_limits: False
 * /robot_description_planning/joint_limits/torso_joint_b1/has_velocity_limits: True
 * /robot_description_planning/joint_limits/torso_joint_b1/max_acceleration: 0
 * /robot_description_planning/joint_limits/torso_joint_b1/max_velocity: 2.26
 * /robot_description_planning/joint_limits/torso_joint_b2/has_acceleration_limits: False
 * /robot_description_planning/joint_limits/torso_joint_b2/has_velocity_limits: True
 * /robot_description_planning/joint_limits/torso_joint_b2/max_acceleration: 0
 * /robot_description_planning/joint_limits/torso_joint_b2/max_velocity: 2.26
 * /robot_description_semantic: <?xml version="1....
 * /robot_ip_address: 10.0.0.2
 * /rosdistro: melodic
 * /rosversion: 1.14.10
 * /rviz_remodel_TAU_15030_194350916220203429/arm_left/kinematics_solver: kdl_kinematics_pl...
 * /rviz_remodel_TAU_15030_194350916220203429/arm_left/kinematics_solver_search_resolution: 0.005
 * /rviz_remodel_TAU_15030_194350916220203429/arm_left/kinematics_solver_timeout: 0.005
 * /rviz_remodel_TAU_15030_194350916220203429/arm_right/kinematics_solver: kdl_kinematics_pl...
 * /rviz_remodel_TAU_15030_194350916220203429/arm_right/kinematics_solver_search_resolution: 0.005
 * /rviz_remodel_TAU_15030_194350916220203429/arm_right/kinematics_solver_timeout: 0.005
 * /rviz_remodel_TAU_15030_194350916220203429/arms/kinematics_solver: kdl_kinematics_pl...
 * /rviz_remodel_TAU_15030_194350916220203429/arms/kinematics_solver_search_resolution: 0.005
 * /rviz_remodel_TAU_15030_194350916220203429/arms/kinematics_solver_timeout: 0.005
 * /rviz_remodel_TAU_15030_194350916220203429/sda10f/kinematics_solver: kdl_kinematics_pl...
 * /rviz_remodel_TAU_15030_194350916220203429/sda10f/kinematics_solver_search_resolution: 0.005
 * /rviz_remodel_TAU_15030_194350916220203429/sda10f/kinematics_solver_timeout: 0.005
 * /rviz_remodel_TAU_15030_194350916220203429/torso/kinematics_solver: kdl_kinematics_pl...
 * /rviz_remodel_TAU_15030_194350916220203429/torso/kinematics_solver_search_resolution: 0.005
 * /rviz_remodel_TAU_15030_194350916220203429/torso/kinematics_solver_timeout: 0.005
 * /topic_list: [{'joints': ['arm...
 * /warehouse_exec: mongod
 * /warehouse_host: localhost
 * /warehouse_port: 33829

NODES
  /
    io_relay (motoman_driver/io_relay_bswap)
    joint_state (motoman_driver/robot_state_bswap)
    joint_trajectory_action (motoman_driver/motoman_driver_joint_trajectory_action)
    mongo_wrapper_ros_remodel_TAU_15030_8803950497284364922 (warehouse_ros/mongo_wrapper_ros.py)
    motion_streaming_interface (motoman_driver/motion_streaming_interface_bswap)
    move_group (moveit_ros_move_group/move_group)
    robot_state_publisher (robot_state_publisher/robot_state_publisher)
    rviz_remodel_TAU_15030_194350916220203429 (rviz/rviz)

ROS_MASTER_URI=http://localhost:11311

process[joint_state-1]: started with pid [15048]
process[motion_streaming_interface-2]: started with pid [15049]
process[io_relay-3]: started with pid [15054]
process[joint_trajectory_action-4]: started with pid [15061]
[ WARN] [1616758084.473292742]: Failed to get '~port' parameter: using default (50242)
process[robot_state_publisher-5]: started with pid [15066]
process[move_group-6]: started with pid [15068]
process[rviz_remodel_TAU_15030_194350916220203429-7]: started with pid [15074]
ERROR: cannot launch node of type [warehouse_ros/mongo_wrapper_ros.py]: Cannot locate node of type [mongo_wrapper_ros.py] in package [warehouse_ros]. Make sure file exists in package path and permission is set to executable (chmod +x)
[ WARN] [1616758084.531361124]: Tried to connect when socket already in connected state
[ INFO] [1616758084.556065117]: Loading robot model 'motoman_sda10f'...
[ INFO] [1616758084.604272958]: rviz version 1.13.15
[ INFO] [1616758084.604348274]: compiled against Qt version 5.9.5
[ INFO] [1616758084.604358265]: compiled against OGRE version 1.9.0 (Ghadamon)
[ INFO] [1616758084.608642675]: Forcing OpenGl version 0.
[ERROR] [1616758084.641693068]: Group 'torso' is not a chain
[ERROR] [1616758084.641728117]: Kinematics solver of type 'kdl_kinematics_plugin/KDLKinematicsPlugin' could not be initialized for group 'torso'
[ERROR] [1616758084.641774659]: Kinematics solver could not be instantiated for joint group torso.
[ERROR] [1616758084.641800514]: Group 'arms' is not a chain
[ERROR] [1616758084.641814620]: Kinematics solver of type 'kdl_kinematics_plugin/KDLKinematicsPlugin' could not be initialized for group 'arms'
[ERROR] [1616758084.641829665]: Kinematics solver could not be instantiated for joint group arms.
[ERROR] [1616758084.641849929]: Group 'sda10f' is not a chain
[ERROR] [1616758084.641861936]: Kinematics solver of type 'kdl_kinematics_plugin/KDLKinematicsPlugin' could not be initialized for group 'sda10f'
[ERROR] [1616758084.641874891]: Kinematics solver could not be instantiated for joint group sda10f.
[ INFO] [1616758084.708129112]: Publishing maintained planning scene on 'monitored_planning_scene'
[ INFO] [1616758084.710003843]: MoveGroup debug mode is OFF
Starting planning scene monitors...
[ INFO] [1616758084.710023598]: Starting planning scene monitor
[ INFO] [1616758084.712029873]: Listening to '/planning_scene'
[ INFO] [1616758084.712047093]: Starting world geometry update monitor for collision objects, attached objects, octomap updates.
[ INFO] [1616758084.713388817]: Listening to '/collision_object'
[ INFO] [1616758084.714699054]: Listening to '/planning_scene_world' for planning scene world geometry
[ERROR] [1616758084.715164529]: Failed to find 3D sensor plugin parameters for octomap generation
[ INFO] [1616758084.722932835]: Listening to '/attached_collision_object' for attached collision objects
Planning scene monitors started.
[ INFO] [1616758084.743989221]: Initializing OMPL interface using ROS parameters
[ INFO] [1616758084.745702752]: Stereo is NOT SUPPORTED
[ INFO] [1616758084.745749713]: OpenGl version: 3,0 (GLSL 1,3).
[ INFO] [1616758084.777267307]: Using planning interface 'OMPL'
[ INFO] [1616758084.780182251]: Param 'default_workspace_bounds' was not set. Using default value: 10
[ INFO] [1616758084.780938431]: Param 'start_state_max_bounds_error' was set to 0.1
[ INFO] [1616758084.781321837]: Param 'start_state_max_dt' was not set. Using default value: 0.5
[ INFO] [1616758084.781671906]: Param 'start_state_max_dt' was not set. Using default value: 0.5
[ INFO] [1616758084.782016391]: Param 'jiggle_fraction' was set to 0.05
[ INFO] [1616758084.782321598]: Param 'max_sampling_attempts' was not set. Using default value: 100
[ INFO] [1616758084.782376863]: Using planning request adapter 'Add Time Parameterization'
[ INFO] [1616758084.782399109]: Using planning request adapter 'Fix Workspace Bounds'
[ INFO] [1616758084.782415983]: Using planning request adapter 'Fix Start State Bounds'
[ INFO] [1616758084.782432608]: Using planning request adapter 'Fix Start State In Collision'
[ INFO] [1616758084.782448877]: Using planning request adapter 'Fix Start State Path Constraints'
[FATAL] [1616758084.784861824]: Exception while loading controller manager 'moveit_simple_controller_manager/MoveItSimpleControllerManager': According to the loaded plugin descriptions the class moveit_simple_controller_manager/MoveItSimpleControllerManager with base class type moveit_controller_manager::MoveItControllerManager does not exist. Declared types are  moveit_fake_controller_manager/MoveItFakeControllerManager
[ INFO] [1616758084.792989157]: Trajectory execution is managing controllers
Loading 'move_group/ApplyPlanningSceneService'...
Loading 'move_group/ClearOctomapService'...
Loading 'move_group/MoveGroupCartesianPathService'...
Loading 'move_group/MoveGroupExecuteService'...
[ERROR] [1616758084.808900542]: Exception while loading move_group capability 'move_group/MoveGroupExecuteService': MultiLibraryClassLoader: Could not create object of class type move_group::MoveGroupExecuteService as no factory exists for it. Make sure that the library exists and was explicitly loaded through MultiLibraryClassLoader::loadLibrary()
Loading 'move_group/MoveGroupExecuteTrajectoryAction'...
Loading 'move_group/MoveGroupGetPlanningSceneService'...
Loading 'move_group/MoveGroupKinematicsService'...
Loading 'move_group/MoveGroupMoveAction'...
Loading 'move_group/MoveGroupPickPlaceAction'...
Loading 'move_group/MoveGroupPlanService'...
Loading 'move_group/MoveGroupQueryPlannersService'...
Loading 'move_group/MoveGroupStateValidationService'...
[ INFO] [1616758084.833897806]: 

********************************************************
* MoveGroup using: 
*     - ApplyPlanningSceneService
*     - ClearOctomapService
*     - CartesianPathService
*     - ExecuteTrajectoryAction
*     - GetPlanningSceneService
*     - KinematicsService
*     - MoveAction
*     - PickPlaceAction
*     - MotionPlanService
*     - QueryPlannersService
*     - StateValidationService
********************************************************

[ INFO] [1616758084.833976733]: MoveGroup context using planning plugin ompl_interface/OMPLPlanner
[ INFO] [1616758084.833998641]: MoveGroup context initialization complete

You can start planning now!

[ INFO] [1616758088.025891121]: Loading robot model 'motoman_sda10f'...
[ERROR] [1616758088.117199659]: Group 'torso' is not a chain
[ERROR] [1616758088.117253571]: Kinematics solver of type 'kdl_kinematics_plugin/KDLKinematicsPlugin' could not be initialized for group 'torso'
[ERROR] [1616758088.117358937]: Kinematics solver could not be instantiated for joint group torso.
[ERROR] [1616758088.117418339]: Group 'arms' is not a chain
[ERROR] [1616758088.117440441]: Kinematics solver of type 'kdl_kinematics_plugin/KDLKinematicsPlugin' could not be initialized for group 'arms'
[ERROR] [1616758088.117459095]: Kinematics solver could not be instantiated for joint group arms.
[ERROR] [1616758088.117506538]: Group 'sda10f' is not a chain
[ERROR] [1616758088.117525459]: Kinematics solver of type 'kdl_kinematics_plugin/KDLKinematicsPlugin' could not be initialized for group 'sda10f'
[ERROR] [1616758088.117540870]: Kinematics solver could not be instantiated for joint group sda10f.
[ INFO] [1616758088.195087834]: Starting planning scene monitor
[ INFO] [1616758088.196889519]: Listening to '/move_group/monitored_planning_scene'
QObject::connect: Cannot queue arguments of type 'QVector<int>'
(Make sure 'QVector<int>' is registered using qRegisterMetaType().)
QObject::connect: Cannot queue arguments of type 'QVector<int>'
(Make sure 'QVector<int>' is registered using qRegisterMetaType().)
[ INFO] [1616758088.320486583]: Constructing new MoveGroup connection for group 'arm_left' in namespace ''
[ INFO] [1616758089.398358908]: Ready to take commands for planning group arm_left.
[ INFO] [1616758089.398548058]: Looking around: no
[ INFO] [1616758089.398681266]: Replanning: no

image

image

And I obtain this output in Terminal 2:

[ WARN] [1616759313.102987304]: Unable to find a random collision free configuration after 100 attempts
[ WARN] [1616759316.121197131]: Unable to find a random collision free configuration after 100 attempts
[ INFO] [1616759320.917829871]: Planning request received for MoveGroup action. Forwarding to planning pipeline.
[ INFO] [1616759320.919391827]: Found a contact between 'torso_base_link' (type 'Robot link') and 'arm_left_link_6_b' (type 'Robot link'), which constitutes a collision. Contact information is not stored.
[ INFO] [1616759320.919542711]: Collision checking is considered complete (collision was found and 0 contacts are stored)
[ INFO] [1616759320.919660699]: Start state appears to be in collision with respect to group arm_left
[ INFO] [1616759320.920246305]: Found a valid state near the start state at distance 0.103787 after 0 attempts
[ INFO] [1616759320.990079175]: Planner configuration 'arm_left' will use planner 'geometric::RRTConnect'. Additional configuration parameters will be set when the planner is constructed.
[ INFO] [1616759320.992454488]: RRTConnect: Starting planning with 1 states already in datastructure
[ INFO] [1616759320.992597061]: RRTConnect: Starting planning with 1 states already in datastructure
[ INFO] [1616759320.992831813]: RRTConnect: Starting planning with 1 states already in datastructure
[ INFO] [1616759320.992928054]: RRTConnect: Starting planning with 1 states already in datastructure
[ INFO] [1616759321.003570558]: RRTConnect: Created 5 states (2 start + 3 goal)
[ INFO] [1616759321.003867014]: RRTConnect: Created 5 states (2 start + 3 goal)
[ INFO] [1616759321.003979323]: RRTConnect: Created 6 states (2 start + 4 goal)
[ INFO] [1616759321.004125589]: RRTConnect: Created 5 states (2 start + 3 goal)
[ INFO] [1616759321.005485146]: ParallelPlan::solve(): Solution found by one or more threads in 0.013571 seconds
[ INFO] [1616759321.005969110]: RRTConnect: Starting planning with 1 states already in datastructure
[ INFO] [1616759321.006047014]: RRTConnect: Starting planning with 1 states already in datastructure
[ INFO] [1616759321.006192131]: RRTConnect: Starting planning with 1 states already in datastructure
[ INFO] [1616759321.006273648]: RRTConnect: Starting planning with 1 states already in datastructure
[ INFO] [1616759321.006863092]: RRTConnect: Created 5 states (2 start + 3 goal)
[ INFO] [1616759321.007034552]: RRTConnect: Created 5 states (2 start + 3 goal)
[ INFO] [1616759321.007270599]: RRTConnect: Created 5 states (2 start + 3 goal)
[ INFO] [1616759321.007366514]: RRTConnect: Created 5 states (2 start + 3 goal)
[ INFO] [1616759321.007611529]: ParallelPlan::solve(): Solution found by one or more threads in 0.001773 seconds
[ INFO] [1616759321.007924906]: RRTConnect: Starting planning with 1 states already in datastructure
[ INFO] [1616759321.007995030]: RRTConnect: Starting planning with 1 states already in datastructure
[ INFO] [1616759321.008898829]: RRTConnect: Created 5 states (2 start + 3 goal)
[ INFO] [1616759321.009103118]: RRTConnect: Created 5 states (2 start + 3 goal)
[ INFO] [1616759321.009442701]: ParallelPlan::solve(): Solution found by one or more threads in 0.001579 seconds
[ INFO] [1616759321.015630345]: SimpleSetup: Path simplification took 0.005917 seconds and changed from 4 to 2 states
[ INFO] [1616759321.017627230]: Planning adapters have added states at index positions: [ 0 ]
[ INFO] [1616759340.518005105]: Execution request received
[ERROR] [1616759340.518161232]: Unable to identify any set of controllers that can actuate the specified joints: [ arm_left_joint_1_s arm_left_joint_2_l arm_left_joint_3_e arm_left_joint_4_u arm_left_joint_5_r arm_left_joint_6_b arm_left_joint_7_t ]
[ERROR] [1616759340.518215238]: Known controllers and their joints:

[ INFO] [1616759340.523446912]: ABORTED: Solution found but controller failed during execution

I hope you can help me to solve this problem. Please, let me know if you need more information and thank you very much in advance.

Pablo.

marip8 commented 3 years ago

[ERROR] [1616759340.518161232]: Unable to identify any set of controllers that can actuate the specified joints: [ arm_left_joint_1_s arm_left_joint_2_l arm_left_joint_3_e arm_left_joint_4_u arm_left_joint_5_r arm_left_joint_6_b arm_left_joint_7_t ] [ERROR] [1616759340.518215238]: Known controllers and their joints:

This appears to be a MoveIt configuration issue. The move_group node does not know about any controllers that are able to execute trajectories for the particular set of joints that you planned for. These controllers are configured in the controllers.yaml and ..._moveit_controller_manager.launch.xml files of the MoveIt configuration package. This is what they should look like for the SDA10F (pulled from the SDA10F MoveIt config package in this repository):

https://github.com/ros-industrial/motoman/blob/cd971e23993e781ee10080b17d4ab1508bffb8f2/motoman_sda10f_moveit_config/config/controllers.yaml#L1-L24

https://github.com/ros-industrial/motoman/blob/cd971e23993e781ee10080b17d4ab1508bffb8f2/motoman_sda10f_moveit_config/launch/motoman_sda10f_moveit_controller_manager.launch.xml#L1-L8

Are you using the SDA10F MoveIt config package from the kinetic-devel branch of this repository, or a custom version? In either case can you confirm that these two files are configured correctly on your computer? As far as I know, this repository's MoveIt config package for the SDA10F is set up correctly

pablomalvido commented 3 years ago

Thank you for your response,

Yes, both these files (controllers.yaml and motoman_sda10f_moveit_controller_manager.launch.xml) are the ones from the motoman_sda10f_moveit_config package from the kinetic-devel branch of this repository and I didn't modify them, so they are exactly the same as the ones you attached.

Thank you.

pablomalvido commented 3 years ago

Hello,

The problem was finally solved. For those experiencing a similar problem, the error was related to some missing files in MoveIt, not with the robot config files. After reinstalling MoveIt the robot started working.

gavanderhoorn commented 3 years ago

Thanks for reporting back.

the error was related to some missing files in MoveIt

it would be great if you could provide a bit more detail than "some missing files".

Which files specifically?

What should future readers of this issue install in order to avoid the problems you encountered?


Edit: was this one the missing packages?

[FATAL] [1616758084.784861824]: Exception while loading controller manager 'moveit_simple_controller_manager/MoveItSimpleControllerManager': According to the loaded plugin descriptions the class moveit_simple_controller_manager/MoveItSimpleControllerManager with base class type moveit_controller_manager::MoveItControllerManager does not exist. Declared types are  moveit_fake_controller_manager/MoveItFakeControllerManager

How did you build the packages? Did you only clone the git repository into your workspace?

pablomalvido commented 3 years ago

The problem was solved after running:

sudo apt-get install ros-melodic-moveit

The packages of this Motoman repository are working fine, the problem was that MoveIt was not correctly installed in the computer I was using.

How did you build the packages? Did you only clone the git repository into your workspace?

I followed all the steps in the README of the kinetic-devel of the repository.

Thanks

gavanderhoorn commented 3 years ago

Hm.

The rosdep install --from-paths src/ --ignore-src --rosdistro melodic step should've installed all required dependencies.

if that's not the case, there would certainly be "something wrong" with the packages.

pablomalvido commented 3 years ago

I ran that command (rosdep install --from-paths src/ --ignore-src --rosdistro melodic) when installing the motoman packages, but the problem was not solved until running sudo apt-get install ros-melodic-moveit.