Giter Club home page Giter Club logo

panda_moveit_config's Introduction

MoveIt Logo

The MoveIt Motion Planning Framework for ROS. For the ROS 2 repository see MoveIt 2. For the commercially supported version see MoveIt Pro.

Easy-to-use open source robotics manipulation platform for developing commercial applications, prototyping designs, and benchmarking algorithms.

Branches Policy

  • We develop latest features on master.
  • The *-devel branches correspond to released and stable versions of MoveIt for specific distributions of ROS. noetic-devel is synced to master currently.
  • Bug fixes occasionally get backported to these released versions of MoveIt.
  • To facilitate compile-time switching, the patch version of MOVEIT_VERSION of a development branch will be incremented by 1 w.r.t. the package.xml's version number.

MoveIt Status

Continuous Integration

service Melodic Master
GitHub Format CI Format CI
CodeCov codecov codecov
build farm Build Status Build Status
Docker
Pulls
automated build docker

Licenses

FOSSA Status

ROS Buildfarm

MoveIt Package Melodic Source Melodic Debian Noetic Source Noetic Debian
moveit Build Status Build Status Build Status Build Status
moveit_core Build Status Build Status Build Status Build Status
moveit_kinematics Build Status Build Status Build Status Build Status
moveit_planners Build Status Build Status Build Status Build Status
moveit_planners_ompl Build Status Build Status Build Status Build Status
moveit_planners_chomp Build Status Build Status Build Status Build Status
chomp_motion_planner Build Status Build Status Build Status Build Status
moveit_chomp_optimizer_adapter Build Status Build Status Build Status Build Status
pilz_industrial_motion_planner Build Status Build Status Build Status Build Status
pilz_industrial_motion_planner_testutils Build Status Build Status Build Status Build Status
moveit_plugins Build Status Build Status Build Status Build Status
moveit_fake_controller_manager Build Status Build Status Build Status Build Status
moveit_simple_controller_manager Build Status Build Status Build Status Build Status
moveit_ros_control_interface Build Status Build Status Build Status Build Status
moveit_ros Build Status Build Status Build Status Build Status
moveit_ros_planning Build Status Build Status Build Status Build Status
moveit_ros_move_group Build Status Build Status Build Status Build Status
moveit_ros_planning_interface Build Status Build Status Build Status Build Status
moveit_ros_benchmarks Build Status Build Status Build Status Build Status
moveit_ros_perception Build Status Build Status Build Status Build Status
moveit_ros_occupancy_map_monitor Build Status Build Status Build Status Build Status
moveit_ros_manipulation Build Status Build Status Build Status Build Status
moveit_ros_robot_interaction Build Status Build Status Build Status Build Status
moveit_ros_visualization Build Status Build Status Build Status Build Status
moveit_ros_warehouse Build Status Build Status Build Status Build Status
moveit_servo Build Status Build Status Build Status Build Status
moveit_runtime Build Status Build Status Build Status Build Status
moveit_commander Build Status Build Status Build Status Build Status
moveit_setup_assistant Build Status Build Status Build Status Build Status
moveit_msgs Build Status Build Status Build Status Build Status
geometric_shapes Build Status Build Status Build Status Build Status
srdfdom Build Status Build Status Build Status Build Status
moveit_visual_tools Build Status Build Status Build Status Build Status
moveit_tutorials Build Status Build Status

Stargazers over time

Stargazers over time

panda_moveit_config's People

Contributors

droter avatar gollth avatar rhaschke avatar rickstaa avatar tuebel avatar xiaoyu27 avatar

Stargazers

 avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar

Watchers

 avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar

panda_moveit_config's Issues

unify kinetic and melodic into master branch

Kinetic and Melodic branches for this repo have diverged for no reason. Usually, there is no reason to distinguish ROS distros for a moveit_config package.

The latest kinetic release is missing several commits compared to melodic, which is the cause for several issues, e.g. moveit/moveit#1426 and #17.

I suggest to continue development on a master branch only, i.e. drop kinetic-devel and rename melodic-devel to master.

diverged

Discrepancy with Fanka Emika's panda_moveit_config

I'm struggling with the panda moveit configuration. In the simulation, I use the latest version from panda_moveit_config since it solves the problems with the gripper I encountered some time ago (see moveit/moveit#948 (comment) for details). So, simulations run fine: simple motion, picking up objects and placing just works.

However, when it comes to the real robot, I run into some problems. First, according to https://frankaemika.github.io/docs/ros_introduction.html and https://github.com/frankaemika/franka_ros running roslaunch panda_moveit_config panda_moveit.launch should load the MoveIt configuration for the Panda. But, in the ros_planning version there is no panda_moveit.launch file. Is this intended? Is move_group.launch a replacement although it does not load the position_joint_trajectory_controller as Emika's panda_moveit.launch file does?

Or is the configuration provided by the ros-planning/panda_moveit_config solely intended for simulation? (a clue to this is that package.xml does not list franka_description as runtime dependency)

Nevertheless, there are further differences (see this gist). For example, the planning groups are different. Franka Emika provides panda_arm_hand while ros_planning does not. I'm confused which version one should use for development. My assumption is that if code runs fine in simulation it should also do with a real robot. But that's unfortunately not the case.

How to use Moveit on FR3

Hi,

I was wondering if it would be possible to point me to some resources that show how to use moveit on a real robot. I did not see franka_control.launch used in the other launch files.

Thanks in advance!

Cannot find 'panda_control_moveit_rviz.launch'

I want to calibrate my camera using easy_handeye. In its example the robot is started by panda_control_moveit_rviz.launch. However, this file could not be found anymore. Maybe it was deleted in a commit, for I find this file in bing.
Is there any alternative to this file?

Error when I use move_to_start

hello

Following the previous discussion on that issue:
#97

I work on Noetic on Ubuntu 20.04. I have trouble to use move_to_start.launch from franka_ros. I modified the move_to_start.launch file according to @rhaschke advice.

<?xml version="1.0" ?>
<launch>
  <arg name="robot_ip" />

  <include file="$(find franka_control)/launch/franka_control.launch">
    <arg name="robot_ip" value="$(arg robot_ip)" />
    <arg name="load_gripper" value="false" />
  </include>
  <include file="$(find panda_moveit_config)/launch/move_group.launch">
    <arg name="load_gripper" value="false" />
  </include>
  <node name="move_to_start" pkg="franka_example_controllers" type="move_to_start.py" output="screen" required="true" />
</launch>

I get that log:

roslaunch franka_example_controllers move_to_start.launch robot_ip:=172.16.0.2 debug:=true
... logging to /home/dac/.ros/log/601ef3f6-b66f-11ec-bcad-33cf265bcff1/roslaunch-dac-19458.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.

started roslaunch server http://dac:42491/

SUMMARY
========

PARAMETERS
 * /effort_joint_trajectory_controller/constraints/goal_time: 0.5
 * /effort_joint_trajectory_controller/constraints/panda_joint1/goal: 0.05
 * /effort_joint_trajectory_controller/constraints/panda_joint2/goal: 0.05
 * /effort_joint_trajectory_controller/constraints/panda_joint3/goal: 0.05
 * /effort_joint_trajectory_controller/constraints/panda_joint4/goal: 0.05
 * /effort_joint_trajectory_controller/constraints/panda_joint5/goal: 0.05
 * /effort_joint_trajectory_controller/constraints/panda_joint6/goal: 0.05
 * /effort_joint_trajectory_controller/constraints/panda_joint7/goal: 0.05
 * /effort_joint_trajectory_controller/gains/panda_joint1/d: 30
 * /effort_joint_trajectory_controller/gains/panda_joint1/i: 0
 * /effort_joint_trajectory_controller/gains/panda_joint1/p: 600
 * /effort_joint_trajectory_controller/gains/panda_joint2/d: 30
 * /effort_joint_trajectory_controller/gains/panda_joint2/i: 0
 * /effort_joint_trajectory_controller/gains/panda_joint2/p: 600
 * /effort_joint_trajectory_controller/gains/panda_joint3/d: 30
 * /effort_joint_trajectory_controller/gains/panda_joint3/i: 0
 * /effort_joint_trajectory_controller/gains/panda_joint3/p: 600
 * /effort_joint_trajectory_controller/gains/panda_joint4/d: 30
 * /effort_joint_trajectory_controller/gains/panda_joint4/i: 0
 * /effort_joint_trajectory_controller/gains/panda_joint4/p: 600
 * /effort_joint_trajectory_controller/gains/panda_joint5/d: 10
 * /effort_joint_trajectory_controller/gains/panda_joint5/i: 0
 * /effort_joint_trajectory_controller/gains/panda_joint5/p: 250
 * /effort_joint_trajectory_controller/gains/panda_joint6/d: 10
 * /effort_joint_trajectory_controller/gains/panda_joint6/i: 0
 * /effort_joint_trajectory_controller/gains/panda_joint6/p: 150
 * /effort_joint_trajectory_controller/gains/panda_joint7/d: 5
 * /effort_joint_trajectory_controller/gains/panda_joint7/i: 0
 * /effort_joint_trajectory_controller/gains/panda_joint7/p: 50
 * /effort_joint_trajectory_controller/joints: ['panda_joint1', ...
 * /effort_joint_trajectory_controller/type: effort_controller...
 * /franka_control/arm_id: panda
 * /franka_control/collision_config/lower_force_thresholds_acceleration: [20.0, 20.0, 20.0...
 * /franka_control/collision_config/lower_force_thresholds_nominal: [20.0, 20.0, 20.0...
 * /franka_control/collision_config/lower_torque_thresholds_acceleration: [20.0, 20.0, 18.0...
 * /franka_control/collision_config/lower_torque_thresholds_nominal: [20.0, 20.0, 18.0...
 * /franka_control/collision_config/upper_force_thresholds_acceleration: [20.0, 20.0, 20.0...
 * /franka_control/collision_config/upper_force_thresholds_nominal: [20.0, 20.0, 20.0...
 * /franka_control/collision_config/upper_torque_thresholds_acceleration: [20.0, 20.0, 18.0...
 * /franka_control/collision_config/upper_torque_thresholds_nominal: [20.0, 20.0, 18.0...
 * /franka_control/cutoff_frequency: 100
 * /franka_control/internal_controller: joint_impedance
 * /franka_control/joint_limit_warning_threshold: 1
 * /franka_control/joint_names: ['panda_joint1', ...
 * /franka_control/rate_limiting: True
 * /franka_control/realtime_config: enforce
 * /franka_control/robot_ip: 172.16.0.2
 * /franka_state_controller/arm_id: panda
 * /franka_state_controller/joint_names: ['panda_joint1', ...
 * /franka_state_controller/publish_rate: 30
 * /franka_state_controller/type: franka_control/Fr...
 * /joint_state_publisher/rate: 30
 * /joint_state_publisher/source_list: ['franka_state_co...
 * /move_group/allow_trajectory_execution: True
 * /move_group/capabilities: 
 * /move_group/controller_list: [{'name': 'effort...
 * /move_group/default_planning_pipeline: ompl
 * /move_group/disable_capabilities: 
 * /move_group/max_range: 5.0
 * /move_group/moveit_controller_manager: moveit_simple_con...
 * /move_group/moveit_manage_controllers: True
 * /move_group/octomap_frame: camera_rgb_optica...
 * /move_group/octomap_resolution: 0.025
 * /move_group/planning_pipelines/chomp/collision_clearance: 0.2
 * /move_group/planning_pipelines/chomp/collision_threshold: 0.07
 * /move_group/planning_pipelines/chomp/enable_failure_recovery: False
 * /move_group/planning_pipelines/chomp/jiggle_fraction: 0.05
 * /move_group/planning_pipelines/chomp/joint_update_limit: 0.1
 * /move_group/planning_pipelines/chomp/learning_rate: 0.01
 * /move_group/planning_pipelines/chomp/max_iterations: 200
 * /move_group/planning_pipelines/chomp/max_iterations_after_collision_free: 5
 * /move_group/planning_pipelines/chomp/max_recovery_attempts: 5
 * /move_group/planning_pipelines/chomp/obstacle_cost_weight: 1.0
 * /move_group/planning_pipelines/chomp/planning_plugin: chomp_interface/C...
 * /move_group/planning_pipelines/chomp/planning_time_limit: 10.0
 * /move_group/planning_pipelines/chomp/pseudo_inverse_ridge_factor: 1e-4
 * /move_group/planning_pipelines/chomp/request_adapters: default_planner_r...
 * /move_group/planning_pipelines/chomp/ridge_factor: 0.0
 * /move_group/planning_pipelines/chomp/smoothness_cost_acceleration: 1.0
 * /move_group/planning_pipelines/chomp/smoothness_cost_jerk: 0.0
 * /move_group/planning_pipelines/chomp/smoothness_cost_velocity: 0.0
 * /move_group/planning_pipelines/chomp/smoothness_cost_weight: 0.1
 * /move_group/planning_pipelines/chomp/start_state_max_bounds_error: 0.1
 * /move_group/planning_pipelines/chomp/use_pseudo_inverse: False
 * /move_group/planning_pipelines/chomp/use_stochastic_descent: True
 * /move_group/planning_pipelines/ompl/jiggle_fraction: 0.05
 * /move_group/planning_pipelines/ompl/panda_arm/longest_valid_segment_fraction: 0.005
 * /move_group/planning_pipelines/ompl/panda_arm/planner_configs: ['AnytimePathShor...
 * /move_group/planning_pipelines/ompl/panda_arm/projection_evaluator: joints(panda_join...
 * /move_group/planning_pipelines/ompl/panda_hand/planner_configs: ['AnytimePathShor...
 * /move_group/planning_pipelines/ompl/panda_manipulator/longest_valid_segment_fraction: 0.005
 * /move_group/planning_pipelines/ompl/panda_manipulator/planner_configs: ['AnytimePathShor...
 * /move_group/planning_pipelines/ompl/panda_manipulator/projection_evaluator: joints(panda_join...
 * /move_group/planning_pipelines/ompl/planner_configs/AnytimePathShortening/hybridize: True
 * /move_group/planning_pipelines/ompl/planner_configs/AnytimePathShortening/max_hybrid_paths: 24
 * /move_group/planning_pipelines/ompl/planner_configs/AnytimePathShortening/num_planners: 4
 * /move_group/planning_pipelines/ompl/planner_configs/AnytimePathShortening/planners: 
 * /move_group/planning_pipelines/ompl/planner_configs/AnytimePathShortening/shortcut: True
 * /move_group/planning_pipelines/ompl/planner_configs/AnytimePathShortening/type: geometric::Anytim...
 * /move_group/planning_pipelines/ompl/planner_configs/BFMT/balanced: 0
 * /move_group/planning_pipelines/ompl/planner_configs/BFMT/cache_cc: 1
 * /move_group/planning_pipelines/ompl/planner_configs/BFMT/extended_fmt: 1
 * /move_group/planning_pipelines/ompl/planner_configs/BFMT/heuristics: 1
 * /move_group/planning_pipelines/ompl/planner_configs/BFMT/nearest_k: 1
 * /move_group/planning_pipelines/ompl/planner_configs/BFMT/num_samples: 1000
 * /move_group/planning_pipelines/ompl/planner_configs/BFMT/optimality: 1
 * /move_group/planning_pipelines/ompl/planner_configs/BFMT/radius_multiplier: 1.0
 * /move_group/planning_pipelines/ompl/planner_configs/BFMT/type: geometric::BFMT
 * /move_group/planning_pipelines/ompl/planner_configs/BKPIECE/border_fraction: 0.9
 * /move_group/planning_pipelines/ompl/planner_configs/BKPIECE/failed_expansion_score_factor: 0.5
 * /move_group/planning_pipelines/ompl/planner_configs/BKPIECE/min_valid_path_fraction: 0.5
 * /move_group/planning_pipelines/ompl/planner_configs/BKPIECE/range: 0.0
 * /move_group/planning_pipelines/ompl/planner_configs/BKPIECE/type: geometric::BKPIECE
 * /move_group/planning_pipelines/ompl/planner_configs/BiEST/range: 0.0
 * /move_group/planning_pipelines/ompl/planner_configs/BiEST/type: geometric::BiEST
 * /move_group/planning_pipelines/ompl/planner_configs/BiTRRT/cost_threshold: 1e300
 * /move_group/planning_pipelines/ompl/planner_configs/BiTRRT/frountier_node_ratio: 0.1
 * /move_group/planning_pipelines/ompl/planner_configs/BiTRRT/frountier_threshold: 0.0
 * /move_group/planning_pipelines/ompl/planner_configs/BiTRRT/init_temperature: 100
 * /move_group/planning_pipelines/ompl/planner_configs/BiTRRT/range: 0.0
 * /move_group/planning_pipelines/ompl/planner_configs/BiTRRT/temp_change_factor: 0.1
 * /move_group/planning_pipelines/ompl/planner_configs/BiTRRT/type: geometric::BiTRRT
 * /move_group/planning_pipelines/ompl/planner_configs/EST/goal_bias: 0.05
 * /move_group/planning_pipelines/ompl/planner_configs/EST/range: 0.0
 * /move_group/planning_pipelines/ompl/planner_configs/EST/type: geometric::EST
 * /move_group/planning_pipelines/ompl/planner_configs/FMT/cache_cc: 1
 * /move_group/planning_pipelines/ompl/planner_configs/FMT/extended_fmt: 1
 * /move_group/planning_pipelines/ompl/planner_configs/FMT/heuristics: 0
 * /move_group/planning_pipelines/ompl/planner_configs/FMT/nearest_k: 1
 * /move_group/planning_pipelines/ompl/planner_configs/FMT/num_samples: 1000
 * /move_group/planning_pipelines/ompl/planner_configs/FMT/radius_multiplier: 1.1
 * /move_group/planning_pipelines/ompl/planner_configs/FMT/type: geometric::FMT
 * /move_group/planning_pipelines/ompl/planner_configs/KPIECE/border_fraction: 0.9
 * /move_group/planning_pipelines/ompl/planner_configs/KPIECE/failed_expansion_score_factor: 0.5
 * /move_group/planning_pipelines/ompl/planner_configs/KPIECE/goal_bias: 0.05
 * /move_group/planning_pipelines/ompl/planner_configs/KPIECE/min_valid_path_fraction: 0.5
 * /move_group/planning_pipelines/ompl/planner_configs/KPIECE/range: 0.0
 * /move_group/planning_pipelines/ompl/planner_configs/KPIECE/type: geometric::KPIECE
 * /move_group/planning_pipelines/ompl/planner_configs/LBKPIECE/border_fraction: 0.9
 * /move_group/planning_pipelines/ompl/planner_configs/LBKPIECE/min_valid_path_fraction: 0.5
 * /move_group/planning_pipelines/ompl/planner_configs/LBKPIECE/range: 0.0
 * /move_group/planning_pipelines/ompl/planner_configs/LBKPIECE/type: geometric::LBKPIECE
 * /move_group/planning_pipelines/ompl/planner_configs/LBTRRT/epsilon: 0.4
 * /move_group/planning_pipelines/ompl/planner_configs/LBTRRT/goal_bias: 0.05
 * /move_group/planning_pipelines/ompl/planner_configs/LBTRRT/range: 0.0
 * /move_group/planning_pipelines/ompl/planner_configs/LBTRRT/type: geometric::LBTRRT
 * /move_group/planning_pipelines/ompl/planner_configs/LazyPRM/range: 0.0
 * /move_group/planning_pipelines/ompl/planner_configs/LazyPRM/type: geometric::LazyPRM
 * /move_group/planning_pipelines/ompl/planner_configs/LazyPRMstar/type: geometric::LazyPR...
 * /move_group/planning_pipelines/ompl/planner_configs/PDST/type: geometric::PDST
 * /move_group/planning_pipelines/ompl/planner_configs/PRM/max_nearest_neighbors: 10
 * /move_group/planning_pipelines/ompl/planner_configs/PRM/type: geometric::PRM
 * /move_group/planning_pipelines/ompl/planner_configs/PRMstar/type: geometric::PRMstar
 * /move_group/planning_pipelines/ompl/planner_configs/ProjEST/goal_bias: 0.05
 * /move_group/planning_pipelines/ompl/planner_configs/ProjEST/range: 0.0
 * /move_group/planning_pipelines/ompl/planner_configs/ProjEST/type: geometric::ProjEST
 * /move_group/planning_pipelines/ompl/planner_configs/RRT/goal_bias: 0.05
 * /move_group/planning_pipelines/ompl/planner_configs/RRT/range: 0.0
 * /move_group/planning_pipelines/ompl/planner_configs/RRT/type: geometric::RRT
 * /move_group/planning_pipelines/ompl/planner_configs/RRTConnect/range: 0.0
 * /move_group/planning_pipelines/ompl/planner_configs/RRTConnect/type: geometric::RRTCon...
 * /move_group/planning_pipelines/ompl/planner_configs/RRTstar/delay_collision_checking: 1
 * /move_group/planning_pipelines/ompl/planner_configs/RRTstar/goal_bias: 0.05
 * /move_group/planning_pipelines/ompl/planner_configs/RRTstar/range: 0.0
 * /move_group/planning_pipelines/ompl/planner_configs/RRTstar/type: geometric::RRTstar
 * /move_group/planning_pipelines/ompl/planner_configs/SBL/range: 0.0
 * /move_group/planning_pipelines/ompl/planner_configs/SBL/type: geometric::SBL
 * /move_group/planning_pipelines/ompl/planner_configs/SPARS/dense_delta_fraction: 0.001
 * /move_group/planning_pipelines/ompl/planner_configs/SPARS/max_failures: 1000
 * /move_group/planning_pipelines/ompl/planner_configs/SPARS/sparse_delta_fraction: 0.25
 * /move_group/planning_pipelines/ompl/planner_configs/SPARS/stretch_factor: 3.0
 * /move_group/planning_pipelines/ompl/planner_configs/SPARS/type: geometric::SPARS
 * /move_group/planning_pipelines/ompl/planner_configs/SPARStwo/dense_delta_fraction: 0.001
 * /move_group/planning_pipelines/ompl/planner_configs/SPARStwo/max_failures: 5000
 * /move_group/planning_pipelines/ompl/planner_configs/SPARStwo/sparse_delta_fraction: 0.25
 * /move_group/planning_pipelines/ompl/planner_configs/SPARStwo/stretch_factor: 3.0
 * /move_group/planning_pipelines/ompl/planner_configs/SPARStwo/type: geometric::SPARStwo
 * /move_group/planning_pipelines/ompl/planner_configs/STRIDE/degree: 16
 * /move_group/planning_pipelines/ompl/planner_configs/STRIDE/estimated_dimension: 0.0
 * /move_group/planning_pipelines/ompl/planner_configs/STRIDE/goal_bias: 0.05
 * /move_group/planning_pipelines/ompl/planner_configs/STRIDE/max_degree: 18
 * /move_group/planning_pipelines/ompl/planner_configs/STRIDE/max_pts_per_leaf: 6
 * /move_group/planning_pipelines/ompl/planner_configs/STRIDE/min_degree: 12
 * /move_group/planning_pipelines/ompl/planner_configs/STRIDE/min_valid_path_fraction: 0.2
 * /move_group/planning_pipelines/ompl/planner_configs/STRIDE/range: 0.0
 * /move_group/planning_pipelines/ompl/planner_configs/STRIDE/type: geometric::STRIDE
 * /move_group/planning_pipelines/ompl/planner_configs/STRIDE/use_projected_distance: 0
 * /move_group/planning_pipelines/ompl/planner_configs/TRRT/frountierNodeRatio: 0.1
 * /move_group/planning_pipelines/ompl/planner_configs/TRRT/frountier_threshold: 0.0
 * /move_group/planning_pipelines/ompl/planner_configs/TRRT/goal_bias: 0.05
 * /move_group/planning_pipelines/ompl/planner_configs/TRRT/init_temperature: 10e-6
 * /move_group/planning_pipelines/ompl/planner_configs/TRRT/k_constant: 0.0
 * /move_group/planning_pipelines/ompl/planner_configs/TRRT/max_states_failed: 10
 * /move_group/planning_pipelines/ompl/planner_configs/TRRT/min_temperature: 10e-10
 * /move_group/planning_pipelines/ompl/planner_configs/TRRT/range: 0.0
 * /move_group/planning_pipelines/ompl/planner_configs/TRRT/temp_change_factor: 2.0
 * /move_group/planning_pipelines/ompl/planner_configs/TRRT/type: geometric::TRRT
 * /move_group/planning_pipelines/ompl/planning_plugin: ompl_interface/OM...
 * /move_group/planning_pipelines/ompl/request_adapters: default_planner_r...
 * /move_group/planning_pipelines/ompl/start_state_max_bounds_error: 0.1
 * /move_group/planning_pipelines/pilz_industrial_motion_planner/capabilities: pilz_industrial_m...
 * /move_group/planning_pipelines/pilz_industrial_motion_planner/default_planner_config: PTP
 * /move_group/planning_pipelines/pilz_industrial_motion_planner/planning_plugin: pilz_industrial_m...
 * /move_group/planning_pipelines/pilz_industrial_motion_planner/request_adapters: 
 * /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/sense_for_plan/max_safe_path_cost: 1
 * /move_group/trajectory_execution/allowed_execution_duration_scaling: 1.2
 * /move_group/trajectory_execution/allowed_goal_duration_margin: 0.5
 * /move_group/trajectory_execution/allowed_start_tolerance: 0.01
 * /position_joint_trajectory_controller/constraints/goal_time: 0.5
 * /position_joint_trajectory_controller/constraints/panda_joint1/goal: 0.05
 * /position_joint_trajectory_controller/constraints/panda_joint2/goal: 0.05
 * /position_joint_trajectory_controller/constraints/panda_joint3/goal: 0.05
 * /position_joint_trajectory_controller/constraints/panda_joint4/goal: 0.05
 * /position_joint_trajectory_controller/constraints/panda_joint5/goal: 0.05
 * /position_joint_trajectory_controller/constraints/panda_joint6/goal: 0.05
 * /position_joint_trajectory_controller/constraints/panda_joint7/goal: 0.05
 * /position_joint_trajectory_controller/joints: ['panda_joint1', ...
 * /position_joint_trajectory_controller/type: position_controll...
 * /robot_description: <?xml version="1....
 * /robot_description_kinematics/manipulator/kinematics_solver: kdl_kinematics_pl...
 * /robot_description_kinematics/manipulator/kinematics_solver_search_resolution: 0.005
 * /robot_description_kinematics/manipulator/kinematics_solver_timeout: 0.05
 * /robot_description_kinematics/panda_arm/kinematics_solver: kdl_kinematics_pl...
 * /robot_description_kinematics/panda_arm/kinematics_solver_search_resolution: 0.005
 * /robot_description_kinematics/panda_arm/kinematics_solver_timeout: 0.05
 * /robot_description_planning/cartesian_limits/max_rot_vel: 1.57
 * /robot_description_planning/cartesian_limits/max_trans_acc: 2.25
 * /robot_description_planning/cartesian_limits/max_trans_dec: -5
 * /robot_description_planning/cartesian_limits/max_trans_vel: 1
 * /robot_description_planning/default_acceleration_scaling_factor: 0.1
 * /robot_description_planning/default_velocity_scaling_factor: 0.1
 * /robot_description_planning/joint_limits/panda_finger_joint1/has_acceleration_limits: False
 * /robot_description_planning/joint_limits/panda_finger_joint1/has_velocity_limits: True
 * /robot_description_planning/joint_limits/panda_finger_joint1/max_acceleration: 0
 * /robot_description_planning/joint_limits/panda_finger_joint1/max_velocity: 0.1
 * /robot_description_planning/joint_limits/panda_finger_joint2/has_acceleration_limits: False
 * /robot_description_planning/joint_limits/panda_finger_joint2/has_velocity_limits: True
 * /robot_description_planning/joint_limits/panda_finger_joint2/max_acceleration: 0
 * /robot_description_planning/joint_limits/panda_finger_joint2/max_velocity: 0.1
 * /robot_description_planning/joint_limits/panda_joint1/has_acceleration_limits: True
 * /robot_description_planning/joint_limits/panda_joint1/has_velocity_limits: True
 * /robot_description_planning/joint_limits/panda_joint1/max_acceleration: 3.75
 * /robot_description_planning/joint_limits/panda_joint1/max_velocity: 2.175
 * /robot_description_planning/joint_limits/panda_joint2/has_acceleration_limits: True
 * /robot_description_planning/joint_limits/panda_joint2/has_velocity_limits: True
 * /robot_description_planning/joint_limits/panda_joint2/max_acceleration: 1.875
 * /robot_description_planning/joint_limits/panda_joint2/max_velocity: 2.175
 * /robot_description_planning/joint_limits/panda_joint3/has_acceleration_limits: True
 * /robot_description_planning/joint_limits/panda_joint3/has_velocity_limits: True
 * /robot_description_planning/joint_limits/panda_joint3/max_acceleration: 2.5
 * /robot_description_planning/joint_limits/panda_joint3/max_velocity: 2.175
 * /robot_description_planning/joint_limits/panda_joint4/has_acceleration_limits: True
 * /robot_description_planning/joint_limits/panda_joint4/has_velocity_limits: True
 * /robot_description_planning/joint_limits/panda_joint4/max_acceleration: 3.125
 * /robot_description_planning/joint_limits/panda_joint4/max_velocity: 2.175
 * /robot_description_planning/joint_limits/panda_joint5/has_acceleration_limits: True
 * /robot_description_planning/joint_limits/panda_joint5/has_velocity_limits: True
 * /robot_description_planning/joint_limits/panda_joint5/max_acceleration: 3.75
 * /robot_description_planning/joint_limits/panda_joint5/max_velocity: 2.61
 * /robot_description_planning/joint_limits/panda_joint6/has_acceleration_limits: True
 * /robot_description_planning/joint_limits/panda_joint6/has_velocity_limits: True
 * /robot_description_planning/joint_limits/panda_joint6/max_acceleration: 5
 * /robot_description_planning/joint_limits/panda_joint6/max_velocity: 2.61
 * /robot_description_planning/joint_limits/panda_joint7/has_acceleration_limits: True
 * /robot_description_planning/joint_limits/panda_joint7/has_velocity_limits: True
 * /robot_description_planning/joint_limits/panda_joint7/max_acceleration: 5
 * /robot_description_planning/joint_limits/panda_joint7/max_velocity: 2.61
 * /robot_description_semantic: <?xml version="1....
 * /rosdistro: noetic
 * /rosversion: 1.15.14

NODES
  /
    franka_control (franka_control/franka_control_node)
    joint_state_publisher (joint_state_publisher/joint_state_publisher)
    move_group (moveit_ros_move_group/move_group)
    move_to_start (franka_example_controllers/move_to_start.py)
    robot_state_publisher (robot_state_publisher/robot_state_publisher)
    state_controller_spawner (controller_manager/spawner)
  /panda/
    controller_spawner (controller_manager/spawner)

auto-starting new master
process[master]: started with pid [19532]
ROS_MASTER_URI=http://localhost:11311

setting /run_id to 601ef3f6-b66f-11ec-bcad-33cf265bcff1
process[rosout-1]: started with pid [19557]
started core service [/rosout]
process[franka_control-2]: started with pid [19564]
process[state_controller_spawner-3]: started with pid [19565]
process[robot_state_publisher-4]: started with pid [19566]
process[joint_state_publisher-5]: started with pid [19567]
process[panda/controller_spawner-6]: started with pid [19573]
process[move_group-7]: started with pid [19574]
process[move_to_start-8]: started with pid [19580]
[ WARN] [1649335002.618870000]: FrankaHW: 
	panda_joint2: 36.872732 degrees to joint limits (limits: [-1.762800, 1.762800] q: 1.119249) 
	panda_joint6: 54.567341 degrees to joint limits (limits: [-0.017500, 3.752500] q: 2.800120) 
[ WARN] [1649335002.653540769]: Link 'panda_link0_sc' is not known to URDF. Cannot specify collision default.
[ WARN] [1649335002.655220766]: Link 'panda_link1_sc' is not known to URDF. Cannot specify collision default.
[ WARN] [1649335002.655248969]: Link 'panda_link2_sc' is not known to URDF. Cannot specify collision default.
[ WARN] [1649335002.655261096]: Link 'panda_link3_sc' is not known to URDF. Cannot specify collision default.
[ WARN] [1649335002.655270429]: Link 'panda_link4_sc' is not known to URDF. Cannot specify collision default.
[ WARN] [1649335002.655282948]: Link 'panda_link5_sc' is not known to URDF. Cannot specify collision default.
[ WARN] [1649335002.655292166]: Link 'panda_link6_sc' is not known to URDF. Cannot specify collision default.
[ WARN] [1649335002.655302375]: Link 'panda_link7_sc' is not known to URDF. Cannot specify collision default.
[ WARN] [1649335002.655311302]: Link 'panda_link8_sc' is not known to URDF. Cannot specify collision default.
[ WARN] [1649335002.655342018]: Link 'panda_link0_sc' is not known to URDF. Cannot disable/enable collisons.
[ WARN] [1649335002.655352429]: Link 'panda_link0_sc' is not known to URDF. Cannot disable/enable collisons.
[ WARN] [1649335002.655362264]: Link 'panda_link0_sc' is not known to URDF. Cannot disable/enable collisons.
[ WARN] [1649335002.655371960]: Link 'panda_link0_sc' is not known to URDF. Cannot disable/enable collisons.
[ WARN] [1649335002.655383261]: Link 'panda_link1_sc' is not known to URDF. Cannot disable/enable collisons.
[ WARN] [1649335002.655392779]: Link 'panda_link1_sc' is not known to URDF. Cannot disable/enable collisons.
[ WARN] [1649335002.655402890]: Link 'panda_link1_sc' is not known to URDF. Cannot disable/enable collisons.
[ WARN] [1649335002.655412873]: Link 'panda_link1_sc' is not known to URDF. Cannot disable/enable collisons.
[ WARN] [1649335002.655423346]: Link 'panda_link2_sc' is not known to URDF. Cannot disable/enable collisons.
[ WARN] [1649335002.655433047]: Link 'panda_link2_sc' is not known to URDF. Cannot disable/enable collisons.
[ WARN] [1649335002.655443699]: Link 'panda_link2_sc' is not known to URDF. Cannot disable/enable collisons.
[ WARN] [1649335002.655453343]: Link 'panda_link2_sc' is not known to URDF. Cannot disable/enable collisons.
[ WARN] [1649335002.655464078]: Link 'panda_link3_sc' is not known to URDF. Cannot disable/enable collisons.
[ WARN] [1649335002.655473379]: Link 'panda_link3_sc' is not known to URDF. Cannot disable/enable collisons.
[ INFO] [1649335002.655680452]: Loading robot model 'panda'...
[ INFO] [1649335002.727216907]: Publishing maintained planning scene on 'monitored_planning_scene'
[ INFO] [1649335002.728735527]: Listening to 'joint_states' for joint states
[ INFO] [1649335002.731041873]: Listening to '/attached_collision_object' for attached collision objects
[ INFO] [1649335002.731126872]: Starting planning scene monitor
[ INFO] [1649335002.732159932]: Listening to '/planning_scene'
[ INFO] [1649335002.732243296]: Starting world geometry update monitor for collision objects, attached objects, octomap updates.
[ INFO] [1649335002.733327013]: Listening to '/collision_object'
[ INFO] [1649335002.734439911]: Listening to '/planning_scene_world' for planning scene world geometry
[ INFO] [1649335002.735021693]: No 3D sensor plugin(s) defined for octomap updates
[ INFO] [1649335002.735591586]: Loading planning pipeline 'chomp'
[ INFO] [1649335002.747575246]: Using planning interface 'CHOMP'
[ INFO] [1649335002.749993288]: Param 'default_workspace_bounds' was not set. Using default value: 10
[ INFO] [1649335002.750262831]: Param 'start_state_max_bounds_error' was set to 0.1
[ INFO] [1649335002.750550366]: Param 'start_state_max_dt' was not set. Using default value: 0.5
[ INFO] [1649335002.750790514]: Param 'start_state_max_dt' was not set. Using default value: 0.5
[ INFO] [1649335002.750986638]: Param 'jiggle_fraction' was set to 0.05
[ INFO] [1649335002.751331053]: Param 'max_sampling_attempts' was not set. Using default value: 100
[ INFO] [1649335002.751390496]: Using planning request adapter 'Add Time Parameterization'
[ INFO] [1649335002.751400542]: Using planning request adapter 'Resolve constraint frames to robot links'
[ INFO] [1649335002.751449948]: Using planning request adapter 'Fix Workspace Bounds'
[ INFO] [1649335002.751486652]: Using planning request adapter 'Fix Start State Bounds'
[ INFO] [1649335002.751522095]: Using planning request adapter 'Fix Start State In Collision'
[ INFO] [1649335002.751556498]: Using planning request adapter 'Fix Start State Path Constraints'
[ INFO] [1649335002.752236835]: Loading planning pipeline 'ompl'
[ INFO] [1649335002.796883743]: Using planning interface 'OMPL'
[ INFO] [1649335002.797835457]: Param 'default_workspace_bounds' was not set. Using default value: 10
[ INFO] [1649335002.798026619]: Param 'start_state_max_bounds_error' was set to 0.1
[ INFO] [1649335002.798194284]: Param 'start_state_max_dt' was not set. Using default value: 0.5
[ INFO] [1649335002.798363706]: Param 'start_state_max_dt' was not set. Using default value: 0.5
[ INFO] [1649335002.798520468]: Param 'jiggle_fraction' was set to 0.05
[ INFO] [1649335002.798672883]: Param 'max_sampling_attempts' was not set. Using default value: 100
[ INFO] [1649335002.798695804]: Using planning request adapter 'Add Time Parameterization'
[ INFO] [1649335002.798705081]: Using planning request adapter 'Resolve constraint frames to robot links'
[ INFO] [1649335002.798713734]: Using planning request adapter 'Fix Workspace Bounds'
[ INFO] [1649335002.798724866]: Using planning request adapter 'Fix Start State Bounds'
[ INFO] [1649335002.798733791]: Using planning request adapter 'Fix Start State In Collision'
[ INFO] [1649335002.798742716]: Using planning request adapter 'Fix Start State Path Constraints'
[ INFO] [1649335002.798772423]: Loading planning pipeline 'pilz_industrial_motion_planner'
[ERROR] [1649335002.799708890]: Exception while loading planner 'pilz_industrial_motion_planner::CommandPlanner': According to the loaded plugin descriptions the class pilz_industrial_motion_planner::CommandPlanner with base class type planning_interface::PlannerManager does not exist. Declared types are  chomp_interface/CHOMPPlanner ompl_interface/OMPLPlanner
Available plugins: chomp_interface/CHOMPPlanner, ompl_interface/OMPLPlanner
[ERROR] [1649335002.799746603]: Failed to initialize planning pipeline 'pilz_industrial_motion_planner'.
[INFO] [1649335002.972501]: Controller Spawner: Waiting for service controller_manager/load_controller
[INFO] [1649335002.975731]: Controller Spawner: Waiting for service controller_manager/load_controller
[INFO] [1649335002.978577]: Controller Spawner: Waiting for service controller_manager/switch_controller
[INFO] [1649335002.980432]: Controller Spawner: Waiting for service controller_manager/unload_controller
[INFO] [1649335002.981693]: Loading controller: franka_state_controller
[INFO] [1649335002.987293]: Controller Spawner: Loaded controllers: franka_state_controller
[INFO] [1649335002.992823]: Started controllers: franka_state_controller
[ WARN] [1649335007.619526998]: FrankaHW: 
	panda_joint2: 36.872798 degrees to joint limits (limits: [-1.762800, 1.762800] q: 1.119248) 
	panda_joint6: 54.567382 degrees to joint limits (limits: [-0.017500, 3.752500] q: 2.800120) 
[ WARN] [1649335007.809224793]: Waiting for effort_joint_trajectory_controller/follow_joint_trajectory to come up
[ WARN] [1649335012.620404847]: FrankaHW: 
	panda_joint2: 36.872894 degrees to joint limits (limits: [-1.762800, 1.762800] q: 1.119247) 
	panda_joint6: 54.567341 degrees to joint limits (limits: [-0.017500, 3.752500] q: 2.800120) 
[ WARN] [1649335013.809377367]: Waiting for effort_joint_trajectory_controller/follow_joint_trajectory to come up
[ WARN] [1649335017.621354393]: FrankaHW: 
	panda_joint2: 36.872798 degrees to joint limits (limits: [-1.762800, 1.762800] q: 1.119248) 
	panda_joint6: 54.567422 degrees to joint limits (limits: [-0.017500, 3.752500] q: 2.800119) 
[ERROR] [1649335019.809656907]: Action client not connected: effort_joint_trajectory_controller/follow_joint_trajectory
[ WARN] [1649335022.622148900]: FrankaHW: 
	panda_joint2: 36.872894 degrees to joint limits (limits: [-1.762800, 1.762800] q: 1.119247) 
	panda_joint6: 54.567341 degrees to joint limits (limits: [-0.017500, 3.752500] q: 2.800120) 
[ WARN] [1649335024.824275104]: Waiting for franka_gripper/gripper_action to come up
[ WARN] [1649335027.623094338]: FrankaHW: 
	panda_joint2: 36.872798 degrees to joint limits (limits: [-1.762800, 1.762800] q: 1.119248) 
	panda_joint6: 54.567341 degrees to joint limits (limits: [-0.017500, 3.752500] q: 2.800120) 
[ WARN] [1649335030.824435241]: Waiting for franka_gripper/gripper_action to come up
[ WARN] [1649335032.623922547]: FrankaHW: 
	panda_joint2: 36.872894 degrees to joint limits (limits: [-1.762800, 1.762800] q: 1.119247) 
	panda_joint6: 54.567300 degrees to joint limits (limits: [-0.017500, 3.752500] q: 2.800121) 
[WARN] [1649335033.180827]: Controller Spawner couldn't find the expected controller_manager ROS interface.
[panda/controller_spawner-6] process has finished cleanly
log file: /home/dac/.ros/log/601ef3f6-b66f-11ec-bcad-33cf265bcff1/panda-controller_spawner-6*.log
[ERROR] [1649335036.824595450]: Action client not connected: franka_gripper/gripper_action
[ INFO] [1649335036.835446355]: Returned 0 controllers in list
[ INFO] [1649335036.840764066]: Trajectory execution is managing controllers
[ INFO] [1649335036.840786235]: MoveGroup debug mode is OFF
Loading 'move_group/ApplyPlanningSceneService'...
Loading 'move_group/ClearOctomapService'...
Loading 'move_group/MoveGroupCartesianPathService'...
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] [1649335036.870248189]: 

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

[ INFO] [1649335036.870333486]: MoveGroup context using planning plugin ompl_interface/OMPLPlanner
[ INFO] [1649335036.870351545]: MoveGroup context initialization complete

You can start planning now!

[ WARN] [1649335036.926319662]: Link 'panda_link0_sc' is not known to URDF. Cannot specify collision default.
[ WARN] [1649335036.927240843]: Link 'panda_link1_sc' is not known to URDF. Cannot specify collision default.
[ WARN] [1649335036.927261158]: Link 'panda_link2_sc' is not known to URDF. Cannot specify collision default.
[ WARN] [1649335036.927270307]: Link 'panda_link3_sc' is not known to URDF. Cannot specify collision default.
[ WARN] [1649335036.927277050]: Link 'panda_link4_sc' is not known to URDF. Cannot specify collision default.
[ WARN] [1649335036.927283843]: Link 'panda_link5_sc' is not known to URDF. Cannot specify collision default.
[ WARN] [1649335036.927291515]: Link 'panda_link6_sc' is not known to URDF. Cannot specify collision default.
[ WARN] [1649335036.927298350]: Link 'panda_link7_sc' is not known to URDF. Cannot specify collision default.
[ WARN] [1649335036.927305067]: Link 'panda_link8_sc' is not known to URDF. Cannot specify collision default.
[ WARN] [1649335036.927313048]: Link 'panda_link0_sc' is not known to URDF. Cannot disable/enable collisons.
[ WARN] [1649335036.927319887]: Link 'panda_link0_sc' is not known to URDF. Cannot disable/enable collisons.
[ WARN] [1649335036.927325996]: Link 'panda_link0_sc' is not known to URDF. Cannot disable/enable collisons.
[ WARN] [1649335036.927332367]: Link 'panda_link0_sc' is not known to URDF. Cannot disable/enable collisons.
[ WARN] [1649335036.927338947]: Link 'panda_link1_sc' is not known to URDF. Cannot disable/enable collisons.
[ WARN] [1649335036.927345315]: Link 'panda_link1_sc' is not known to URDF. Cannot disable/enable collisons.
[ WARN] [1649335036.927351964]: Link 'panda_link1_sc' is not known to URDF. Cannot disable/enable collisons.
[ WARN] [1649335036.927358451]: Link 'panda_link1_sc' is not known to URDF. Cannot disable/enable collisons.
[ WARN] [1649335036.927364949]: Link 'panda_link2_sc' is not known to URDF. Cannot disable/enable collisons.
[ WARN] [1649335036.927371325]: Link 'panda_link2_sc' is not known to URDF. Cannot disable/enable collisons.
[ WARN] [1649335036.927377615]: Link 'panda_link2_sc' is not known to URDF. Cannot disable/enable collisons.
[ WARN] [1649335036.927384225]: Link 'panda_link2_sc' is not known to URDF. Cannot disable/enable collisons.
[ WARN] [1649335036.927391032]: Link 'panda_link3_sc' is not known to URDF. Cannot disable/enable collisons.
[ WARN] [1649335036.927397397]: Link 'panda_link3_sc' is not known to URDF. Cannot disable/enable collisons.
[ INFO] [1649335036.927483767]: Loading robot model 'panda'...
[ WARN] [1649335037.624869521]: FrankaHW: 
	panda_joint2: 36.872894 degrees to joint limits (limits: [-1.762800, 1.762800] q: 1.119247) 
	panda_joint6: 54.567300 degrees to joint limits (limits: [-0.017500, 3.752500] q: 2.800121) 
[ INFO] [1649335038.016295289]: Ready to take commands for planning group panda_arm.
[ INFO] [1649335038.044585380]: Combined planning and execution request received for MoveGroup action. Forwarding to planning and execution pipeline.
[ INFO] [1649335038.044802327]: Planning attempt 1 of at most 1
[ INFO] [1649335038.045961950]: Planner configuration 'panda_arm' will use planner 'geometric::RRTConnect'. Additional configuration parameters will be set when the planner is constructed.
[ INFO] [1649335038.046291058]: panda_arm/panda_arm: Starting planning with 1 states already in datastructure
[ INFO] [1649335038.057683745]: panda_arm/panda_arm: Created 4 states (2 start + 2 goal)
[ INFO] [1649335038.057714371]: Solution found in 0.011511 seconds
[ INFO] [1649335038.070130055]: SimpleSetup: Path simplification took 0.012316 seconds and changed from 3 to 2 states
[ INFO] [1649335038.072428992]: Returned 0 controllers in list
[ERROR] [1649335038.072462523]: Unable to identify any set of controllers that can actuate the specified joints: [ panda_joint1 panda_joint2 panda_joint3 panda_joint4 panda_joint5 panda_joint6 panda_joint7 ]
[ERROR] [1649335038.072478020]: Known controllers and their joints:

[ERROR] [1649335038.072503930]: Apparently trajectory initialization failed
[ INFO] [1649335038.072742030]: ABORTED: Solution found but controller failed during execution
================================================================================REQUIRED process [move_to_start-8] has died!
process has finished cleanly
log file: /home/dac/.ros/log/601ef3f6-b66f-11ec-bcad-33cf265bcff1/move_to_start-8*.log
Initiating shutdown!
================================================================================
[move_to_start-8] killing on exit
[move_group-7] killing on exit
[robot_state_publisher-4] killing on exit
[state_controller_spawner-3] killing on exit
[franka_control-2] killing on exit
[joint_state_publisher-5] killing on exit
[INFO] [1649335039.122425]: Shutting down spawner. Stopping and unloading controllers...
[INFO] [1649335039.123570]: Stopping all controllers...
[WARN] [1649335039.240186]: Controller Spawner error while taking down controllers: unable to connect to service: [Errno 104] Connection reset by peer
[rosout-1] killing on exit
[master] killing on exit
shutting down processing monitor...
... shutting down processing monitor complete
done

Release 0.7.x for Noetic

As #72 seems to require additional work, would it be possible to release the existing melodic-devel branch for Noetic? I only performed basic tests, but it seems to work without issues on Noetic. Our franka_example_controllers package depends on panda_moveit_config, so we cannot publish it to the ROS repos unless panda_moveit_config is in there as well.

Cannot control gripper in Noetic version

Hi I just installed the noetic version on Ubuntu 20 and was able to control a real robot arm using moveit and python binding. However, I could not close the gripper... Here is my step-to-step illustration of the issue:

First, here is the python code that runs well on the melodic version:

import rospy
import actionlib
from control_msgs.msg import GripperCommandAction, GripperCommandGoal

"""
This file tests the gripper (open <--> close)
"""

def main():
    rospy.init_node("grippter_test")
    # breakpoint()
    gripper_client = actionlib.SimpleActionClient('/franka_gripper/gripper_action', GripperCommandAction)
    gripper_client.wait_for_server()
    rospy.loginfo('gripper action server started.')
    goal = GripperCommandGoal()
    goal.command.position = 0
    # goal.width = 0.05
    gripper_client.send_goal(goal)
    rospy.loginfo('goal sent.')
    gripper_client.wait_for_result()

if __name__=="__main__":
    main()

Running the script would be stuck at gripper_client.wait_for_result().

Then, in rviz, if i choose the planning group as panda_hand, I can see the gripper visualization getting closed:
image
However, the real robot does not move and I get the following error in the console:

[ INFO] [1653884561.353749456]: SimpleSetup: Path simplification took 0.047645 seconds and changed from 7 to 2 states
[ INFO] [1653884561.354453863]: Planning adapters have added states at index positions: [ 0 ]
[ERROR] [1653884566.691940361]: Controller is taking too long to execute trajectory (the expected upper bound for the trajectory execution was 5.314105 seconds). Stopping trajectory.
[ INFO] [1653884566.691990321]: Cancelling execution for franka_gripper
[ INFO] [1653884566.692089448]: Completed trajectory execution with status TIMED_OUT ...
[ INFO] [1653884566.728909471]: ABORTED: Timeout reached

Then I checked which controllers are running via: rosservice call /controller_manager/list_controllers and here is the output, no gripper controller is getting run...

controller: 
  - 
    name: "franka_state_controller"
    state: "running"
    type: "franka_control/FrankaStateController"
    claimed_resources: 
      - 
        hardware_interface: "franka_hw::FrankaStateInterface"
        resources: []
  - 
    name: "position_joint_trajectory_controller"
    state: "running"
    type: "position_controllers/JointTrajectoryController"
    claimed_resources: 
      - 
        hardware_interface: "hardware_interface::PositionJointInterface"
        resources: 
          - panda_joint1
          - panda_joint2
          - panda_joint3
          - panda_joint4
          - panda_joint5
          - panda_joint6
          - panda_joint7

Finally, I wrote this controller yaml file for the default controller:

 controller_list:
  - name: position_joint_trajectory_controller
    action_ns: follow_joint_trajectory
    type: FollowJointTrajectory
    default: true
    joints:
      - panda_joint1
      - panda_joint2
      - panda_joint3
      - panda_joint4
      - panda_joint5
      - panda_joint6
      - panda_joint7
  - name: franka_gripper
    action_ns: gripper_action
    type: GripperCommand
    default: true
    joints:
      - panda_finger_joint1
      - panda_finger_joint2

`
Could anyone provide some pointers on how to fix this? This is really urgent so any feedback would be greatly appreciated. Thanks.

How to control a real franka robot arm?

I want to use moveit to control a real franka robot arm. I try changing the value of fake_execution to false in demo.launch, but it doesn't work. and terminal shows "Action client not connected: position_joint_trajectory_controller/follow_joint_trajectory".

What should I do? Thank you very much.

End-Effector Visualization for move group 'manipulator' wrongly placed

Details

If I want to plan with the manipulator move group and choose this in the RVIZ Motion Planning Plugin, the Interactive Marker Gizmo shows at the wrong link, namely at panda_link8 with the 45ยฐ rotation:
Screenshot from 2022-02-09 09-48-03

Expected Behaviour

The Gizmo shows in a way, that I can drag the EE around nicely:

Screenshot from 2022-02-09 09-53-55

Steps to Reproduce

roslaunch panda_moveit_config demo.launch

and choose manipulator in RVIZ Motion Planning Plugin.

How do we set the end_effector_link and pose_reference_frame from within the launch file?

While working with Panda and MoveIt (using our custom launch files, based on the panda_moveit_config ones), we realised that in our scripts we have to set the following two lines to "tell" MoveIt the appropriate reference frame and end-effector link:

moveit_group.set_end_effector_link("panda_hand_tcp")
moveit_group.set_pose_reference_frame("panda_link0")

Although this solves the problem, we want to move this into the move_group.launch launch file. Is there any way we could set those two values through the launch file?

Thank you in advance.

Running OMPL as a pre-processor for STOMP doesn't work.

I'm following the Planning Adapter Tutorials of Moveit! at http://docs.ros.org/kinetic/api/moveit_tutorials/html/doc/planning_adapters/planning_adapters_tutorial.html, but I can't implement the Running OMPL as a pre-processor for STOMP. Although I installed stomp_core from source which origined from https://github.com/ros-industrial/stomp_ros, I got an error like this:
[ERROR] [1581905685.671780997]: Exception while loading planning adapter plugin 'stomp/SmoothingAdapter': According to the loaded plugin descriptions the class stomp/SmoothingAdapter with base class type planning_request_adapter::PlanningRequestAdapter does not exist. Declared types are chomp/OptimizerAdapter default_planner_request_adapters/AddIterativeSplineParameterization default_planner_request_adapters/AddTimeOptimalParameterization default_planner_request_adapters/AddTimeParameterization default_planner_request_adapters/Empty default_planner_request_adapters/FixStartStateBounds default_planner_request_adapters/FixStartStateCollision default_planner_request_adapters/FixStartStatePathConstraints default_planner_request_adapters/FixWorkspaceBounds default_planner_request_adapters/ResolveConstraintFrames industrial_trajectory_filters/AddSmoothingFilter industrial_trajectory_filters/NPointFilter industrial_trajectory_filters/UniformSampleFilter
Is there anyone who has run the demo successfully or anyone who can tell me how to solve this problem?

Moveit! Gazebo integration

Hello,
I'm trying to control the gazebo simulated robot from moveit.
My current scenario is:-

  1. I'm using panda robot and I have done motion planning using move group interface (c++) code and visualised it in rviz.

  2. Now i want to use the motion planning from moveit to control a robot in Gazebo.
    I have seen this webpage and i have also done the steps related to ROS control and simulation window and generated a new URDF file.
    I have saved this newly generated URDF in my package as a new file and i spawned gazebo using below commands:

roslaunch gazebo_ros empty_world.launch paused:=true use_sim_time:=false gui:=true throttled:=false recording:=false debug:=true

and

rosrun gazebo_ros spawn_model -file </path_to_new_urdf/file_name.urdf> -urdf -x 0 -y 0 -z 1 -model panda.

  1. Then i launch rviz using:

roslaunch panda_moveit_config demo.launch

  1. and lastly i launch my node using

roslaunch panda_moveit_config panda_move_group.launch

After doing all this steps i cant see any movement in Gazebo and my bot falls down in gazebo.

My question now is:

  1. what i'm doing wrong? How can i spawn panda robot in gazebo?

  2. is there any way that you can send me ideal steps to be followed? if possible link of some code files ??

Thanking you in anticipation,
Vishal

Unable to interact with moveit following tutorial

screenshot
I can't get step 2 to work following the guide here exactly as written. I have interact selected, but it just moves the camera, and no interactive markers appear. I only see the green and orange highlighted portions of the robot.

I see that the latest commit on melodic-devel was 4 days ago, whereas the tutorial was updated 22 days ago. My apologies if this is not the right place to ask.

collision problem from start the panda moveit demo.launch in noetic version

Hi
I installed recently the moveit for noetic from link and clone the panda-moveit.config the melodic version (-b melodic-devel) like in the Installation was. But when I launch it
roslaunch panda_moveit_config demo.launch rviz_tutorial:=true
from the start the panda robot is in collision state I think (the links are red) like in the picture.
image

Then I reinstalled it this time with (-b noetic-devel). It didn't solved the Problem.
After that i tried to do a motion planning but I got the error:
Panda-arm:Motion planning start tree could not be initialized

How can I solve this issue?

where is panda.srdf?

Hi, I am learning the tutorial-Visualizing Collisions.
When I run "roslaunch moveit_tutorials visualizing_collisions_tutorial.launch", it will come out with ERROR:ioerror: [errno 2] no such file or directory: 'myubuntu/catkin_ws/src/panda_moveit_config/config/panda.srdf'.
Then I go through the .launch file, find the code below:

<!-- load SRDF -->
<param name="robot_description_semantic" textfile="$(find panda_moveit_config)/config/panda.srdf" />

It seems like there is no panda.srdf in the /panda_moveit_config/config in this repository and this package.
What can I do to fix it? Thanks in advance!

Problem following tutorial: Franka entangled

Hi,
I am trying to follow the tutorial here. Before starting, I successfully completed the previous one, which is a prerequisite.
Launching the demo in step one works fine. The Rviz window opens up as expected. However, after adding the motion planning plugin, the robot doesn't look like in the tutorial, but is entangled, as can be seen in the following image.
Screenshot from 2019-05-20 17-52-36
This screenshot was taken right after adding the plugin without changing any settings.

When I continue to follow the tutorial and arrive at step 3, I can interact with the robot. However, instead of being able to bring the robot into a more "normal" configuration, the joints just spin randomly, see this screenshot.
Screenshot from 2019-05-20 17-55-57

Could you tell me what I am doing wrong here? Any help is greatly appreciated!

I'm using Ubuntu 18.04 and installed ROS Melodic as described in the "Getting Started" tutorial.

Thanks in advance and kind regards.

No joint state information if virtual joint is set to floating

If the virtual joint in panda_arm.xacro is set to floating, then haveCompletedState() from StateMonitor never returns true Indicating we have no joint state information for at least one joint. I saw similar issues (#33 ) but they are in kinetic, I am running melodic

ROS Noetic Version Broken in Apt

When I install this on 20.04 using sudo apt install ros-noetic-franka-ros ros-noetic-franka-description and try launching with roslaunch panda_moveit_config demo.launch, I get an error saying
No such file or directory: /opt/ros/noetic/share/franka_description/robots/panda_arm_hand.urdf.xacro.

From what I found online, this is due an error in this launch file: /opt/ros/noetic/share/panda_moveit_config/launch/planning_context.launch and how it shouldn't load a separate URDF for the hand anymore. From what I can tell, the code is already fixed in the noetic-devel branch. I think this just needs to be updated in apt and it should work.

planning_context confusion

Hi,

On line 24 of the demo.launch file, the planning_context.launch file is included.

Later, on line 42 of the demo.launch file, move_group.launch is included (which is expected). Afterwards, the move_group.launch file then includes the planning_context.launch file again?!?!?!?

Why is this file being included twice in the same pipeline? I did some poking around, and it seems like the MoveIt Setup Assistant Wizard also generates files this way?

Two panda robots

Dear all,

I am working with two real panda robots. I built a MoveIT package for interface with the two panda robots and it works fine in the simulator. Then, I configured the controllers.yaml to act with the real two robots via the combined_panda/effort_joint_trajectory_controller and I can read and visualize the robots state/joints values (/combined_panda/joints) in the Rviz.

I have three planning groups in the moveIT package.
1- panda_1 (panda_1_joint1 โ€ฆ panda_1_joint7)
2- pnada_2 (panda_1_joint1 โ€ฆ panda_2_joint7)
3- combined_panda (panda_1_joint1 โ€ฆ panda_1_joint7 โ€ฆ panda_2_joint1 โ€ฆ panda_2 _joint7)

From rviz, I can control both robots (combined_panda planning group) to reach different/random poses, and it is working fine. But I can not control one robot separately (I can not use ( panda_1 planning group or panda_2 planning group), it gives the following error,
franka_comined_control โ€œERROR: joints on incoming goal donโ€™t match the controller jointsโ€

So, I run different move_groups on a script:
1- for panda_1
2- for panda_2
and execute the two move_goups as two threads in the script. But it still doesnโ€™t work.

When I worked with the combined group (14 joints โ†’ which has the two subgroups (panda_1 and panda_2)), and I set a target pose for every robot (panda_1 and panda_1) and execute them from one planning group by setting the pose target and gripper link of every robot. It give me these error:
โ€˜โ€™ Unable to solve planning problemโ€™โ€™
โ€˜โ€™ More than one constraint is set. If your move_group does not have multiple end effector/arms, this is unusual. and a move_group interface and forgetting to call clearPoseTargets () or equivalent?โ€™โ€™

Can anyone help me in this regard ?

Regression on the current kinetic-devel

tl;dr 6ae03fa doesn't fix for me the virtual joint issue that was fixed for #22, and it's not the case of just propagating the publisher to another launch file.

The issue

With the same exact process running, checking out panda_moveit_config 0.7.1 runs fine but the current kinetic-devel gives erratic behaviour and this diff in the output (I tried to keep it as short as possible:

--- /home/ap/Desktop/kinetic-devel
+++ /home/ap/Desktop/0.7.1
@@ -187,6 +187,7 @@
  * /position_joint_trajectory_controller/type: position_controll...
  * /robot_description: <?xml version="1....
  * /robot_description_kinematics/panda_arm/kinematics_solver: kdl_kinematics_pl...
+ * /robot_description_kinematics/panda_arm/kinematics_solver_attempts: 5
  * /robot_description_kinematics/panda_arm/kinematics_solver_search_resolution: 0.001
  * /robot_description_kinematics/panda_arm/kinematics_solver_timeout: 0.05
  * /robot_description_planning/joint_limits/panda_finger_joint1/has_acceleration_limits: False
@@ -229,6 +230,7 @@
  * /rosdistro: kinetic
  * /rosversion: 1.12.14
  * /rviz_ap_NUC7i7DNKE_15599_3838872138042140295/panda_arm/kinematics_solver: kdl_kinematics_pl...
+ * /rviz_ap_NUC7i7DNKE_15599_3838872138042140295/panda_arm/kinematics_solver_attempts: 5
  * /rviz_ap_NUC7i7DNKE_15599_3838872138042140295/panda_arm/kinematics_solver_search_resolution: 0.001
  * /rviz_ap_NUC7i7DNKE_15599_3838872138042140295/panda_arm/kinematics_solver_timeout: 0.05
 
@@ -288,13 +290,12 @@
 [ INFO] - [/move_group::PlanningSceneMonitor::startWorldGeometryMonitor::1025]: Starting world geometry monitor
 [ INFO] - [/move_group::PlanningSceneMonitor::startWorldGeometryMonitor::1041]: Listening to '/collision_object' using message notifier with target frame '/world '
 [ INFO] - [/move_group::PlanningSceneMonitor::startWorldGeometryMonitor::1056]: Listening to '/planning_scene_world' for planning scene world geometry
-[ INFO] - [/move_group::PointCloudOctomapUpdater::start::114]: Listening to '/camera/depth_registered/points' using message filter with target frame '/world '
+[ INFO] - [/move_group::PointCloudOctomapUpdater::start::114]: Listening to '/camera/depth_registered/points' using message filter with target frame '/panda_link0 '
 [INFO] - [/controller_spawner::main::192]: Controller Spawner: Loaded controllers: position_joint_trajectory_controller
 [ INFO] - [/move_group::PlanningSceneMonitor::startStateMonitor::1118]: Listening to '/attached_collision_object' for attached collision objects
 Context monitors started.
 [ INFO] - [/franka_control::FrankaHW::prepareSwitch::371]: FrankaHW: Prepared switching controllers to joint_position with parameters limit_rate=1, cutoff_frequency=100, internal_controller=joint_impedance
 [INFO] - [/controller_spawner::main::201]: Started controllers: position_joint_trajectory_controller
-[ERROR] - [/franka_control::main::206]: libfranka: Move command rejected: command not possible in the current mode!
 [ INFO] - [/move_group::OMPLInterface::OMPLInterface::55]: Initializing OMPL interface using ROS parameters
 [ INFO] - [/move_group::PlanningPipeline::configure::119]: Using planning interface 'OMPL'
 [ INFO] - [/move_group::FixWorkspaceBounds::FixWorkspaceBounds::53]: Param 'default_workspace_bounds' was not set. Using default value: 10
@@ -308,7 +309,6 @@
 [ INFO] - [/move_group::PlanningPipeline::configure::163]: Using planning request adapter 'Fix Start State Bounds'
 [ INFO] - [/move_group::PlanningPipeline::configure::163]: Using planning request adapter 'Fix Start State In Collision'
 [ INFO] - [/move_group::PlanningPipeline::configure::163]: Using planning request adapter 'Fix Start State Path Constraints'
-[ WARN] - [/move_group::CurrentStateMonitor::tfCallback::441]: Unable to update multi-DOF joint 'virtual_joint': TF has no common time between '/world' and 'panda_link0': 
 [ INFO] - [/franka_control::<lambda::131]: Recovered from error
 [ INFO] - [/move_group::MoveItSimpleControllerManager::MoveItSimpleControllerManager::145]: Added FollowJointTrajectory controller for position_joint_trajectory_controller
 [ INFO] - [/rviz_ap_NUC7i7DNKE_15599_3838872138042140295::RenderWindow* rviz::RenderSystem::makeRenderWindow::441]: Stereo is NOT SUPPORTED
@@ -352,7 +352,6 @@
 
 [ INFO] - [/process_manager::core::RobotModel::buildModel::93]: Loading robot model 'panda'...
 [ INFO] - [/process_manager::core::RobotModel::buildModel::93]: Loading robot model 'panda'...
-[ WARN] - [/move_group::PlanningSceneMonitor::updateSceneWithCurrentState::1255]: The complete state of the robot is not yet known.  Missing virtual_joint
 [ INFO] - [/process_manager::planning_interface::MoveGroupInterface::MoveGroupInterfaceImpl::MoveGroupInterfaceImpl::178]: Ready to take commands for planning group panda_arm.
 [ INFO] - [/process_manager::Panda::Panda::403]: Waiting for a subscriber on topic /world_to_panda_link0.
 [ INFO] - [/static_transform_aggregator::StaticTransformAggregator::sendAllTransforms_::98]: Currently static broadcasting:
@@ -376,12 +375,12 @@
 [ INFO] - [/move_group::OMPLPlannerManager::OMPLPlannerManager::185]: RRTConnect: Starting planning with 1 states already in datastructure
 [ INFO] - [/move_group::OMPLPlannerManager::OMPLPlannerManager::185]: RRTConnect: Starting planning with 1 states already in datastructure
 [ INFO] - [/move_group::OMPLPlannerManager::OMPLPlannerManager::185]: RRTConnect: Starting planning with 1 states already in datastructure
-[ INFO] - [/move_group::OMPLPlannerManager::OMPLPlannerManager::292]: RRTConnect: Created 5 states (2 start + 3 goal)
-[ INFO] - [/move_group::OMPLPlannerManager::OMPLPlannerManager::292]: RRTConnect: Created 4 states (2 start + 2 goal)
-[ INFO] - [/move_group::OMPLPlannerManager::OMPLPlannerManager::292]: RRTConnect: Created 5 states (2 start + 3 goal)
-[ INFO] - [/move_group::OMPLPlannerManager::OMPLPlannerManager::292]: RRTConnect: Created 5 states (2 start + 3 goal)
-[ INFO] - [/move_group::OMPLPlannerManager::OMPLPlannerManager::129]: ParallelPlan::solve(): Solution found by one or more threads in 0.013718 seconds
-[ INFO] - [/move_group::OMPLPlannerManager::OMPLPlannerManager::185]: SimpleSetup: Path simplification took 0.005437 seconds and changed from 3 to 2 states
+[ INFO] - [/move_group::OMPLPlannerManager::OMPLPlannerManager::292]: RRTConnect: Created 4 states (2 start + 2 goal)
+[ INFO] - [/move_group::OMPLPlannerManager::OMPLPlannerManager::292]: RRTConnect: Created 4 states (2 start + 2 goal)
+[ INFO] - [/move_group::OMPLPlannerManager::OMPLPlannerManager::292]: RRTConnect: Created 4 states (2 start + 2 goal)
+[ INFO] - [/move_group::OMPLPlannerManager::OMPLPlannerManager::292]: RRTConnect: Created 4 states (2 start + 2 goal)
+[ INFO] - [/move_group::OMPLPlannerManager::OMPLPlannerManager::129]: ParallelPlan::solve(): Solution found by one or more threads in 0.012583 seconds
+[ INFO] - [/move_group::OMPLPlannerManager::OMPLPlannerManager::185]: SimpleSetup: Path simplification took 0.004107 seconds and changed from 3 to 2 states
 [ INFO] - [/process_manager::planning_interface::MoveGroupInterface::Plan cobotica::Panda::createValidPlan_::1134]: Visualizing plan for current target.
 [ INFO] - [/move_group::MoveGroupExecuteTrajectoryAction::executePath::94]: Execution request received
 [rostopic-12] process has finished cleanly
@@ -419,60 +418,24 @@
 [ INFO] - [/process_manager::updateTf::42]: Updated world->lightbulb_base transform.
 [ INFO] - [/process_manager::CodedScene::addObjectToPlanningScene_::107]: Added lamp_1 to the planning scene.
 [ INFO] - [/move_group::MoveGroupMoveAction::executeMoveCallback_PlanOnly::163]: Planning request received for MoveGroup action. Forwarding to planning pipeline.
-[ WARN] - [/move_group::JointConstraint::configure::179]: Joint panda_joint2 is constrained to be above the maximum bounds. Assuming maximum bounds instead.
-[ WARN] - [/move_group::JointConstraint::configure::179]: Joint panda_joint4 is constrained to be above the maximum bounds. Assuming maximum bounds instead.
-[ WARN] - [/move_group::JointConstraint::configure::179]: Joint panda_joint2 is constrained to be above the maximum bounds. Assuming maximum bounds instead.
-[ WARN] - [/move_group::JointConstraint::configure::179]: Joint panda_joint4 is constrained to be above the maximum bounds. Assuming maximum bounds instead.
 [ INFO] - [/move_group::ModelBasedPlanningContext::useConfig::335]: Planner configuration 'panda_arm' will use planner 'geometric::RRTConnect'. Additional configuration parameters will be set when the planner is constructed.
 [ INFO] - [/move_group::OMPLPlannerManager::OMPLPlannerManager::185]: RRTConnect: Starting planning with 1 states already in datastructure
 [ INFO] - [/move_group::OMPLPlannerManager::OMPLPlannerManager::185]: RRTConnect: Starting planning with 1 states already in datastructure
 [ INFO] - [/move_group::OMPLPlannerManager::OMPLPlannerManager::185]: RRTConnect: Starting planning with 1 states already in datastructure
 [ INFO] - [/move_group::OMPLPlannerManager::OMPLPlannerManager::185]: RRTConnect: Starting planning with 1 states already in datastructure
-[ WARN] - [/move_group::ConstrainedGoalSampler::sampleUsingConstraintSampler::139]: More than 80% of the sampled goal states fail to satisfy the constraints imposed on the goal sampler. Is the constrained sampler working correctly?
-[ INFO] - [/move_group::ConstraintEvaluationResult kinematic_constraints::JointConstraint::decide::236]: Constraint satisfied:: Joint name: 'panda_joint1', actual value: 0.000001, desired value: 0.000000, tolerance_above: 0.000100, tolerance_below: 0.000100
-[ INFO] - [/move_group::ConstraintEvaluationResult kinematic_constraints::JointConstraint::decide::236]: Constraint satisfied:: Joint name: 'panda_joint2', actual value: 1.570700, desired value: 1.570700, tolerance_above: 0.000100, tolerance_below: 0.000000
-[ INFO] - [/move_group::ConstraintEvaluationResult kinematic_constraints::JointConstraint::decide::236]: Constraint satisfied:: Joint name: 'panda_joint3', actual value: 0.000011, desired value: 0.000000, tolerance_above: 0.000100, tolerance_below: 0.000100
-[ INFO] - [/move_group::ConstraintEvaluationResult kinematic_constraints::JointConstraint::decide::236]: Constraint satisfied:: Joint name: 'panda_joint4', actual value: -0.069800, desired value: -0.069800, tolerance_above: 0.000100, tolerance_below: 0.000000
-[ INFO] - [/move_group::ConstraintEvaluationResult kinematic_constraints::JointConstraint::decide::236]: Constraint violated:: Joint name: 'panda_joint5', actual value: -2.228626, desired value: -nan, tolerance_above: 0.000100, tolerance_below: 0.000100
-[ INFO] - [/move_group::ConstraintEvaluationResult kinematic_constraints::JointConstraint::decide::236]: Constraint satisfied:: Joint name: 'panda_joint6', actual value: -0.000074, desired value: 0.000000, tolerance_above: 0.000100, tolerance_below: 0.000100
-[ INFO] - [/move_group::ConstraintEvaluationResult kinematic_constraints::JointConstraint::decide::236]: Constraint satisfied:: Joint name: 'panda_joint7', actual value: -0.000034, desired value: 0.000000, tolerance_above: 0.000100, tolerance_below: 0.000100
-[ERROR] - [/move_group::OMPLPlannerManager::OMPLPlannerManager::215]: RRTConnect: Unable to sample any valid states for goal tree
-[ INFO] - [/move_group::OMPLPlannerManager::OMPLPlannerManager::292]: RRTConnect: Created 1 states (1 start + 0 goal)
-[ERROR] - [/move_group::OMPLPlannerManager::OMPLPlannerManager::215]: RRTConnect: Unable to sample any valid states for goal tree
-[ INFO] - [/move_group::OMPLPlannerManager::OMPLPlannerManager::292]: RRTConnect: Created 1 states (1 start + 0 goal)
-[ERROR] - [/move_group::OMPLPlannerManager::OMPLPlannerManager::215]: RRTConnect: Unable to sample any valid states for goal tree
-[ INFO] - [/move_group::OMPLPlannerManager::OMPLPlannerManager::292]: RRTConnect: Created 1 states (1 start + 0 goal)
-[ERROR] - [/move_group::OMPLPlannerManager::OMPLPlannerManager::215]: RRTConnect: Unable to sample any valid states for goal tree
-[ INFO] - [/move_group::OMPLPlannerManager::OMPLPlannerManager::292]: RRTConnect: Created 1 states (1 start + 0 goal)
-[ WARN] - [/move_group::OMPLPlannerManager::OMPLPlannerManager::131]: ParallelPlan::solve(): Unable to find solution by any of the threads in 0.020978 seconds
-[ INFO] - [/move_group::ModelBasedPlanningContext::solve::593]: Unable to solve the planning problem
-[ WARN] - [/process_manager::planning_interface::MoveItErrorCode moveit::planning_interface::MoveGroupInterface::MoveGroupInterfaceImpl::plan::840]: Fail: ABORTED: No motion plan found. No execution attempted.
-[ INFO] - [/process_manager::planning_interface::MoveGroupInterface::Plan cobotica::Panda::createValidPlan_::1134]: Visualizing plan for current target: FAILED
+[ INFO] - [/move_group::OMPLPlannerManager::OMPLPlannerManager::292]: RRTConnect: Created 4 states (2 start + 2 goal)
+[ INFO] - [/move_group::OMPLPlannerManager::OMPLPlannerManager::292]: RRTConnect: Created 4 states (2 start + 2 goal)
+[ INFO] - [/move_group::OMPLPlannerManager::OMPLPlannerManager::292]: RRTConnect: Created 4 states (2 start + 2 goal)
+[ INFO] - [/move_group::OMPLPlannerManager::OMPLPlannerManager::292]: RRTConnect: Created 5 states (2 start + 3 goal)
+[ INFO] - [/move_group::OMPLPlannerManager::OMPLPlannerManager::129]: ParallelPlan::solve(): Solution found by one or more threads in 0.022040 seconds
+[ INFO] - [/move_group::OMPLPlannerManager::OMPLPlannerManager::185]: SimpleSetup: Path simplification took 0.005353 seconds and changed from 3 to 2 states
+[ INFO] - [/process_manager::planning_interface::MoveGroupInterface::Plan cobotica::Panda::createValidPlan_::1134]: Visualizing plan for current target.
 [ INFO] - [/move_group::MoveGroupExecuteTrajectoryAction::executePath::94]: Execution request received
 [ INFO] - [/move_group::TrajectoryExecutionManager::executeThread::1304]: Completed trajectory execution with status SUCCEEDED ...
 [ INFO] - [/move_group::MoveGroupExecuteTrajectoryAction::executePath::118]: Execution completed: SUCCEEDED
 [ INFO] - [/process_manager::Panda::moveInternal_::1106]: Executing plan for current target.
 [ INFO] - [/move_group::MoveGroupMoveAction::executeMoveCallback_PlanOnly::163]: Planning request received for MoveGroup action. Forwarding to planning pipeline.
-[ INFO] - [/move_group::FixStartStatePathConstraints::adaptAndPlan::73]: Path constraints not satisfied for start state...
-[ INFO] - [/move_group::ConstraintEvaluationResult kinematic_constraints::OrientationConstraint::decide::627]: Orientation constraint violated for link 'panda_link8'. Quaternion desired: 0.746576 -0.309240 0.544224 -0.225424, quaternion actual: 0.923960 -0.382490 0.000037 0.000034, error: x=1.144130, y=0.738413, z=0.488842, tolerance: x=0.001000, y=0.001000, z=3.142000
-[ INFO] - [/move_group::FixStartStatePathConstraints::adaptAndPlan::75]: Planning to path constraints...
-[ INFO] - [/move_group::ModelBasedPlanningContext::useConfig::335]: Planner configuration 'panda_arm' will use planner 'geometric::RRTConnect'. Additional configuration parameters will be set when the planner is constructed.
-[ INFO] - [/move_group::OMPLPlannerManager::OMPLPlannerManager::185]: RRTConnect: Starting planning with 1 states already in datastructure
-[ INFO] - [/move_group::OMPLPlannerManager::OMPLPlannerManager::185]: RRTConnect: Starting planning with 1 states already in datastructure
-[ INFO] - [/move_group::OMPLPlannerManager::OMPLPlannerManager::185]: RRTConnect: Starting planning with 1 states already in datastructure
-[ INFO] - [/move_group::OMPLPlannerManager::OMPLPlannerManager::185]: RRTConnect: Starting planning with 1 states already in datastructure
-[ INFO] - [/move_group::OMPLPlannerManager::OMPLPlannerManager::292]: RRTConnect: Created 5 states (2 start + 3 goal)
-[ INFO] - [/move_group::OMPLPlannerManager::OMPLPlannerManager::292]: RRTConnect: Created 6 states (2 start + 4 goal)
-[ INFO] - [/move_group::OMPLPlannerManager::OMPLPlannerManager::292]: RRTConnect: Created 5 states (2 start + 3 goal)
-[ INFO] - [/move_group::OMPLPlannerManager::OMPLPlannerManager::292]: RRTConnect: Created 5 states (3 start + 2 goal)
-[ INFO] - [/move_group::OMPLPlannerManager::OMPLPlannerManager::129]: ParallelPlan::solve(): Solution found by one or more threads in 0.063474 seconds
-[ INFO] - [/move_group::OMPLPlannerManager::OMPLPlannerManager::185]: SimpleSetup: Path simplification took 0.002666 seconds and changed from 3 to 2 states
-[ INFO] - [/move_group::FixStartStatePathConstraints::adaptAndPlan::92]: Planned to path constraints. Resuming original planning request.
 [ INFO] - [/move_group::core::RobotModel::buildModel::93]: Loading robot model 'panda'...
-[ WARN] - [/move_group::JointConstraint::configure::179]: Joint panda_joint2 is constrained to be above the maximum bounds. Assuming maximum bounds instead.
-[ WARN] - [/move_group::JointConstraint::configure::179]: Joint panda_joint4 is constrained to be above the maximum bounds. Assuming maximum bounds instead.
-[ WARN] - [/move_group::JointConstraint::configure::179]: Joint panda_joint2 is constrained to be above the maximum bounds. Assuming maximum bounds instead.
-[ WARN] - [/move_group::JointConstraint::configure::179]: Joint panda_joint4 is constrained to be above the maximum bounds. Assuming maximum bounds instead.
 [ INFO] - [/move_group::ModelBasedPlanningContext::useConfig::335]: Planner configuration 'panda_arm' will use planner 'geometric::RRTConnect'. Additional configuration parameters will be set when the planner is constructed.
 [ INFO] - [/move_group::base::StateSamplerPtr ompl_interface::ModelBasedPlanningContext::allocPathConstrainedSampler::200]: panda_arm: Allocating specialized state sampler for state space
 [ INFO] - [/move_group::base::StateSamplerPtr ompl_interface::ModelBasedPlanningContext::allocPathConstrainedSampler::200]: panda_arm: Allocating specialized state sampler for state space

Basically what I see is kinetic-devel giving many more collision states and joint constraint violations without any physical differences between the two plannings.

What I tried

Skimming the commits that happened between the two tags (convenience link to comparison), I can see:

  • removal of kinematics_solver_attempts: should be irrelevant
  • modification of virtual joint: I think this might be the cause, as everything seems to stem from Unable to update multi-DOF joint 'virtual_joint': TF has no common time between '/world' and 'panda_link0' (which is incidentally different from this).

Seems to be this this problem but I tried to apply the fix to my own higher level launch file or directly to panda_control_moveit_rviz, and it doesn't solve the issue, whereas like the comment says if I change floating to fixed it does work.

EDIT1: The addition of the virtual_joint_publisher removes these two messages:

[ WARN] - [/move_group::CurrentStateMonitor::tfCallback::441]: Unable to update multi-DOF joint 'virtual_joint': TF has no common time between '/world' and 'panda_link0': 
[ WARN] - [/move_group::PlanningSceneMonitor::updateSceneWithCurrentState::1255]: The complete state of the robot is not yet known.  Missing virtual_joint

but produces no further change in behaviour: Insufficient states in sampleable goal region, Orientation constraint violated for link 'x', More than 80% of the sampled goal states fail to satisfy the constraints imposed on the goal sampler., etc as before.

EDIT2:

  • roswtf doesn't help much as the comments are the same with floating and fixed virtual joint;
  • I have a static transform aggregator as per what was suggested by tfoote in an answer some time ago and I tried not using it in case that was the issue by cheating my way through (sub to both topics I usually wait for subscribers for, and manually static publishing of the other transform I need) but to no different outcome.

Noetic Release (0.8.0)

Noetic Release (0.8.0)

franka_description was released: https://index.ros.org/p/franka_description/#noetic

Before we cut the release we should regenerate this based on the master version of the moveit setup assistant. @rhaschke

Checklist

  • Update based on master branch of moveit setup assistant
  • Make noetic-devel branch
  • Run ROS buildfarm prerelease test
  • Update changelogs
  • Bloom
  • Write discourse post

Remapping of joint_states intended?

Hello!

I stumbled on the line which remaps the joint states:
<remap from="/joint_states" to="/joint_states_desired" />
(l. 78 in move_group.launch)

Is this line intended? I am working with a real panda robot and was creating launch files for two different usecases. In both cases, I removed this line, as it seemed to be not only not-necessary; but also hindering, as it prevented move_group from getting the real joint states. Is this desired?

It looks like I'm not the only one who came across this (see here), so it would be great if you could look over it and check which way it should be.

Thank you!

MoveIt Assistant can't locate SRDF

I'm trying to debug some move_group related errors on my code and stumbled on this.

Running rosrun moveit_setup_assistant moveit_setup_assistant --config_pkg ~/catkin_ws/src/panda_moveit_config/ or roslaunch moveit_setup_assistant setup_assistant.launch and choosing this package and --inorder results in error Unable to locate the SRDF file: /home/<user>/catkin_ws/src/panda_moveit_config/config/panda.srdf.

This seems to be due to file .setup_assistant where the highlighted line should read something like relative_path: config/panda_arm_hand.srdf.xacro.

This seems to be due to the moving from the old panda_moveit_config in franka_ros, as I can see it was like this there.

Was this intended? This wasn't mentioned in the PR.

run-time error with franka_ros example

With the current apt version of ros-melodic-panda-moveit-config and the current franka_ros, when launching e.g. the move to start example:

roslaunch franka_example_controllers move_to_start.launch

I get the following error message:

[ERROR] [1615826543.912941470]: Exception while loading planning adapter plugin 'default_planner_request_adapters/ResolveConstraintFrames': According to the loaded plugin descriptions the class default_planner_request_adapters/ResolveConstraintFrames with base class type planning_request_adapter::PlanningRequestAdapter does not exist. Declared types are  default_planner_request_adapters/AddIterativeSplineParameterization default_planner_request_adapters/AddTimeOptimalParameterization default_planner_request_adapters/AddTimeParameterization default_planner_request_adapters/Empty default_planner_request_adapters/FixStartStateBounds default_planner_request_adapters/FixStartStateCollision default_planner_request_adapters/FixStartStatePathConstraints default_planner_request_adapters/FixWorkspaceBounds

My installed packages are all up to date...

The order of planning_adapters in moveit planner pipeline

The planning_adapters of ompl_planning_pipeline.launch.xml in panda_moveit_config(kinetic-devel) is the order of the following:

default_planner_request_adapters/AddTimeParameterization
default_planner_request_adapters/FixWorkspaceBounds
default_planner_request_adapters/FixStartStateBounds
default_planner_request_adapters/FixStartStateCollision
default_planner_request_adapters/FixStartStatePathConstraints

However, The planning_adapters of ompl_planning_pipeline.launch.xml in panda_moveit_config(melodic-devel) is the order of the following:

default_planner_request_adapters/FixWorkspaceBounds
default_planner_request_adapters/FixStartStateBounds
default_planner_request_adapters/FixStartStateCollision
default_planner_request_adapters/FixStartStatePathConstraints
default_planner_request_adapters/ResolveConstraintFrames
default_planner_request_adapters/AddTimeParameterization"

I am very confused about why default_planner_request_adapters/AddTimeParameterization changes the order in planning_adapters ? Is that a bug ?

Update moveit_tutorials (Noetic)

The MoveIt tutorials should be updated now that the new noetic branch has been released. This issue tracks this process.

TODOS

@tylerjw already performed some tests for his solution with the moveit_tutorials. We however need to re-perform these tests for the new Noetic release. Please first check #74 (comment) before testing one of the following tutorials:

  • Getting Started
  • MoveIt Quickstart in RViz
    • /move_group/display_planned_path should be move_group/display_planned_path.
  • Move Group C++ Interface
  • Move Group Python Interface
  • MoveIt Commander Scripting
  • Robot Model and Robot State
  • Planning Scene
  • Planning Scene Monitor
  • Planning Scene ROS API
  • Motion Planning API
  • Motion Planning Pipeline
  • Creating MoveIt Plugins
  • Visualizing Collisions
  • Time Parameterization
  • Planning with approximated Constraint Manifolds
  • Pick and Place
  • MoveIt Grasps
  • MoveIt Task Constructor
  • MoveIt Deep Grasps
  • Subframes
  • MoveItCpp Tutorial
  • Using Bullet for Collision Checking
  • Mesh Filter with UR5 and Kinect
  • MoveIt Setup Assistant moveit/moveit_tutorials#678
    • The panda_tool will be renamed change group picture.
    • The extended and ready pose in the panda_moveit_config are in collision now (see https://github.com/rickstaa/msa_test). This should be fixed in the panda_moveit_config and the pose picture should be updated.
  • URDF and SRDF
  • Low Level Controllers
  • Preception Pipeline Tutorial
  • IKFast Kinematics Solver
  • TRACK-IK Kinematics Solver
  • OPW Kinematics Solver for Industrial Manipulators
  • Kinematics Configuration
  • Custom Constraint Samplers
  • Representation and Evaluation of Constraints
  • OMPL Planner
  • CHOMP Planner
  • STOMP Planner
  • TrajOpt Planner
  • Pilz Industrial Motion Planner
  • Sequence of multiple segments
  • Planning Adapter Tutorials
  • Warehouse - Persistent Scenes and States
  • Joystick Control Teleoperation
  • Realtime Arm Servoing
  • Benchmarking
  • Integration/Unit Tests
  • Debugging Tests

I also found the following changes that need to be performed to the moveit_tutorials:

  • Maybe the panda_control_moveit_rviz.launch file should be documented in the documentation.
  • The demo_chomp.launch file was added to the panda_moveit_config repository, but this file is not used in the moveit_tutorials.
  • The lerp planner documentation talks about a lerp_example.launch file but this file is not included I think this should be changed to refer the demo_lerp.launch file.
  • The gazebo simulation intergration tutorial can be removed.

Real Panda aborts motion with current joint limits in `joint_limits.yaml`

Dear MoveIt-Experts,

thank you for developing and maintaining this framework!

I'm using Panda for my research and am currently trying to optimize its execution speed. So far, I had been using the default joint limits from the config/joint_limits.yaml (from an earlier version of the moveit config) with all the max_velocity limits set to the values given in the FE FCI documentation and all max_acceleration limits set to zero and encountered no problems during execution.

I tried setting the values for max_acceleration to the values currently given in joint_limits.yaml on the melodic and noetic branches, leading to Panda moving considerably faster but consistently throwing libfranka: Move command aborted: motion aborted by reflex! error and stopping the motion when trying to execute the task.

With some trying around I could reestablish reliable execution by setting the max_acceleration_scaling_factor to 0.5.

My question is: Have these limits been tested on real hardware and should work without throwing this error? If so, what could be the reason for my Panda aborting these movements?

Thanks and best regards!

No collision geometry

When i was ran : roslaunch panda_moveit_config panda_control_moveit_rviz.launch load_gripper:=true robot_ip:=172.16.0.2. Some warn occurred as following:

[ WARN] [1600866644.391617690]: Link panda_leftfinger has visual geometry but no collision geometry. Collision geometry will be left empty. Fix your URDF file by explicitly specifying collision geometry.
[ WARN] [1600866644.392008313]: Link panda_rightfinger has visual geometry but no collision geometry. Collision geometry will be left empty. Fix your URDF file by explicitly specifying collision geometry.

Installing this package in Noetic gets the Melodic release

When installing the package ros-noetic-panda-moveit-config the Melodic release is installed, which is not compatible with the Noetic version of franka_description which is one of its dependencies.

The error is following:

Param xml is <param if="$(eval arg('load_robot_description') and arg('load_gripper'))" name="$(arg robot_description)" command="$(find xacro)/xacro '$(find franka_description)/robots/panda_arm_hand.urdf.xacro'"/>

That's because in the Noetic branch the robot description with and without the gripper has been merged compared to Melodic.

How come one gets the Melodic release in ROS Noetic?

Does /franka_control/set_EE_frame service change the end effector of current move group ?

Using /franka_control/set_EE_frame service can set NE_T_EE, thus changes 'panda_ee' frame in TF tree. I wonder when using moveit for planning after set_EE_frame, what happens to the defined end effector?

e.g., when using panda_manipulator move group, the default end effector is 'pand_hand_tcp', and 'panda_ee' frame is equal to 'pand_hand_tcp' frame, the planed cartesian path is for 'pand_hand_tcp', right? but after using set_EE_frame, the 'panda_ee' frame is changed, then the planned path is for the changed 'panda_ee' or still for 'pand_hand_tcp'?

Noetic release

I reworked (and force-pushed) the noetic-devel branch once more as announced in #89 (comment).

The new branch can be considered a release candidate, but relies on several open PRs in franka_ros (also see frankaemika/franka_ros#193) and MoveIt, namely:

Other open TODOs (@rickstaa, can you work on these?):

Noetic release

We just released the initial version of the Noetic branch. This issue will be used for the rest of the release process.

Upstream pull requests that are required

The following upstream pull requests need to be merged for the Noetic branch to be warning and error free:

The following upstream pull request is required for the simulation to work:

Noetic branch todos

  • As pointed out by @tahsinkose in c46c81c#r58426734 the version of the franka_gazebo package should be pinnned to v0.8.* or higher. We can do this by using the version_gte argument when the upstream issues have been merged.
  • We have to check if remaping joint_states to joint_states_desired in the move_group.launch file is still needed
    EDIT(rhaschke): joint_states_desired just reports commanded joint values. Not needed for MoveIt.
  • We have to add the stomp_ros package as a commented-out depedency when its debian package been released (see ros-industrial/stomp_ros#1).
  • rhaschke#14 Needs to be merged into the noetic-branch.
  • #92 The new moveit_sim_controller should be added to the controller_managers.
    EDIT(rhaschke): Better consider http://wiki.ros.org/fake_joint
  • #91 The code should be cleaned up.
  • Change repository documentation url to noetic. Currently on kinetic.
  • Check and update the moveit_tutorials.

Moveit_setup_assistant todos

I found several improvements that can be made to the MSA.

Other upstream problems that still exist

Migration guide

For future reference, the following steps were performed to release the Noetic branch:

Noetic migration guide
  1. I created the initial panda robot configuration using the moveit_setup_assistant (see 8566b70). In this branch, tree/82378877879f7d40727819b1c3345eeb4308d98b was used. Similar to #74 I changed some posed to prevent self collisions.

  2. I modified the panda.srdf file that is created by the moveit_setup_assistant such that we can programmatically enable the gripper (see f0c2bca). This needs to be done, since the moveit_setup_assistant currently doesn't propagate xacro arguments you supply to the urdf.xacro file (see this issue). We therefore need to manually add a way to enable or disable the gripper. This can be done by creating a panda.srdf.xacro file.

  3. I replaced the sensor_3d.yaml with the example files in the perception_pipeline tutorial. Also edit the sensor_manager.launch.xml file to point to the right configuration files (see 2aaa01d).

  4. I added the rviz_tutorial flag. While doing this, I made sure that I copied the moveit.rviz and empty.rviz files from the previous ROS version. Additionally, I added the moveit_visual_tools package as a dependency (see 1d55c98).

  5. Similar to df0cbd8 I had to disable the collision checking between joint{5, 6} and joint8 since the new collision geometries that were added to https://github.com/frankaemika/franka_ros/releases/tag/0.8.0 are to coarse (see aa24fae). This should be fixed upstream by, for example, by improving the collision geometries or by giving users the ability to use meshes instead (frankaemika/franka_ros#154).

  6. I added the panda_control_moveit_rviz.launch which can be used to control the real robot (see 36d7c9f).

  7. I added the TrajOpt files that were found in the melodic-devel branch to the repository ( see bc2bbc7 and 88fb278).

  8. I added the STOMP files that were found in the melodic-devel branch to the repository ( see 133d524) .

  9. I updated the join_limits.yaml file that was created by the MSA to enforce jerk limits. This was done by adding acceleration limits, since MoveIt does not yet support jerk limits (see 89d9b44).

  10. I added the files of the LERP planner that is created in the creating-moveit-plugins tutorial (see 85756cd). These files were copied from the melodic-devel branch.

  11. I added the demo_chomp.launch and ompl-chomp_planning_pipeline.launch.xml files needed by the chomp_planner_tutorial tutorial. I also updated the chomp config file to the one found in the melodic-devel branch (see 4c390ac and c2ccca2).

  12. I added the demo_gazebo.launch launch file which spawns a simulated Panda robot in Gazebo (see c46c81c). This launch file uses the new franka_gazebo package that was introduced in franka_ros v0.8.1.

Files that were manually created

Config folder

  • panda.srdf.xacro
  • hand.xacro
  • panda_arm.xacro
  • lerp_planning.yaml
  • stomp_planning.yaml
  • trajopt_planning.yaml
  • panda_controllers.yaml
  • panda_gripper_controllers.yaml

launch

  • demo_stomp.launch (Was not present in the melodic-devel branch).
  • demo_chomp.launch (Not used in the moveit_tutorials).
  • demo_lerp.launch (Used in the moveit_tutorials).
  • lerp_planning_pipeline.launch.xml
  • ompl-chomp_planning_pipeline.launch.xml
  • panda_gripper_moveit_controller_manager.launch.xml
  • run_benchmark_trajopt.launch
  • stomp_planning_pipeline.launch.xml
  • trajopt_planning_pipeline.launch.xml

Add documentation for creating this package.

I recognize that much of what is needed to create this package is documented in the tutorials:
https://ros-planning.github.io/moveit_tutorials/doc/setup_assistant/setup_assistant_tutorial.html

However, there are missing steps in the tutorial to exactly reproduce this repo (default poses for example). Those things should either be documented in the readme for this package or in the tutorials. As the tutorials is more of an example for others on how to setup their robot it shouldn't have to include specifics like the default poses in this package.

Add variable to demo.launch to control starting rviz for simpler test launch files.

@v4hn commented this here about the redundancy needed to build a test in moveit without launching rviz:

This is a lot of redundancy in the launch files and the only reason why you did not use the demo.launch is because it does not include a flag to disable rviz.

I'm fine with merging this patch as-is, but maybe we want to have such a flag in the demo.launch in the future so that tests can just include that one?

I suggest we add a use_rviz variable to demo.launch that defaults to true to simplify the launch files needed for using this for testing in moveit. This won't break existing use cases of demo.launch and then the functionality of it won't have to copy-pasted into launch files for tests.

missing robot state for virtual joint panda_joint8 - Trying to control panda from RVIZ

I'm running ROS Kinetic and am connected to a physical panda arm. As far as I can tell, that setup works fine, as I can control the robot from the Franka Emika GUI just fine.

I'm trying to run the launch file panda_control_moveit_rviz.launch which opens RVIZ and shows a virtual representation of the robot in it's current (physical pose). When I guide the physical robot, the pose is also updated correctly within RVIZ. I am building both franka_ros and panda_moveit_config from the current master branch.

I am not seeing the interactive markers (see moveit/moveit#1399) and I am seeing a warning: The complete state of the robot is not yet known. Missing virtual_joint, panda_joint8. I know that joint8 doesn't exist on the physical robot - likely it has been introduced for the sake of the tutorials (?).

Any ideas regarding a fix?

strange self-collision

When running demo.launch there is a red visualization indicating a self-collision:
image
I am not sure what that means as planning still works. Also looking at the srdf, I do not see why these collisions are enabled, as there is a "disable_default_collisions" for panda_link4_sc. I found 3 different methods to solve this. You can either add:

  • <disable_collisions link1="panda_link3_sc" link2="panda_link4_sc" reason="Never"/>,
  • <disable_collisions link1="panda_link4_sc" link2="panda_link4" reason="Never"/>
  • or <disable_collisions link1="panda_link4_sc" link2="panda_link3" reason="Never"/>

to the srdf.

Looking at the status message, I would guess that you would need both of the last 2 options for this to work, but you only require one of the 3 options. So I am a bit puzzled on what is going on.

I was using the noetic-devel branch for this

What version do we get when we do "sudo apt-get install ros-noetic-panda-moveit-config"?

I struggled quite a lot to get this repo to work with the move_to_start.launch example of the noetic-devel branch of franka_ros: https://github.com/frankaemika/franka_ros/blob/noetic-devel/franka_example_controllers/launch/move_to_start.launch.

The one set up that worked for me was to get the debian version of ros-noetic-panda-moveit-config and to remove the remapping in move_group.launch:

<remap from="/joint_states" to="/joint_states_desired" />

Is it possible to reproduce this setup with source files ?

roslaunch demo.launch fails

I'm on Ubuntu 20.04 + ROS Noetic and I downloaded the noetic-devel branch of this repo, but when I try roslaunch panda_moveit_config demo.launch there is an error caused by the file panda_moveit_config/config/panda_arm.srdf.xacro (i think). However when I clone the melodic-devel branch, the error is gone. I understand the noetic-devel branch is still in development, but I wanted to highlight this issue. The error I get is pasted below:

setting /run_id to 1a3f64ec-884d-11ec-9672-29c550d0c8eb
process[rosout-1]: started with pid [243997]
started core service [/rosout]
process[virtual_joint_broadcaster_0-2]: started with pid [244004]
process[joint_state_publisher-3]: started with pid [244005]
process[robot_state_publisher-4]: started with pid [244006]
process[move_group-5]: started with pid [244012]
process[rviz_nitz_243975_6914526873867292394-6]: started with pid [244013]
[ERROR] [1644262529.644142658]: Link 'panda_hand_tcp' declared as part of a chain in group 'manipulator' is not known to the URDF
[ WARN] [1644262529.645752808]: Group 'manipulator' is empty.
[ERROR] [1644262529.646011577]: Link 'panda_hand_tcp' specified as parent for end effector 'hand_tcp' is not known to the URDF
[ WARN] [1644262529.646079339]: Link 'panda_link0_sc' is not known to URDF. Cannot disable collisons.
[ WARN] [1644262529.646100600]: Link 'panda_link0_sc' is not known to URDF. Cannot disable collisons.
[ WARN] [1644262529.646114909]: Link 'panda_link0_sc' is not known to URDF. Cannot disable collisons.
[ WARN] [1644262529.646129192]: Link 'panda_link0_sc' is not known to URDF. Cannot disable collisons.
[ WARN] [1644262529.646141848]: Link 'panda_link0_sc' is not known to URDF. Cannot disable collisons.
[ WARN] [1644262529.646155262]: Link 'panda_link0_sc' is not known to URDF. Cannot disable collisons.
[ WARN] [1644262529.646168350]: Link 'panda_link0_sc' is not known to URDF. Cannot disable collisons.
[ WARN] [1644262529.646181205]: Link 'panda_link0_sc' is not known to URDF. Cannot disable collisons.
[ WARN] [1644262529.646194263]: Link 'panda_link0_sc' is not known to URDF. Cannot disable collisons.
[ WARN] [1644262529.646224033]: Link 'panda_link1_sc' is not known to URDF. Cannot disable collisons.
[ WARN] [1644262529.646257751]: Link 'panda_link1_sc' is not known to URDF. Cannot disable collisons.
.
.
.
[ WARN] [1644262529.647164256]: Link 'panda_link7_sc' is not known to URDF. Cannot disable collisons.
[ WARN] [1644262529.647186457]: Link 'panda_link8_sc' is not known to URDF. Cannot disable collisons.
[ WARN] [1644262529.647200254]: Link 'panda_link8_sc' is not known to URDF. Cannot disable collisons.
[ WARN] [1644262529.647213326]: Link 'panda_link8_sc' is not known to URDF. Cannot disable collisons.
[ WARN] [1644262529.647226745]: Link 'panda_link8_sc' is not known to URDF. Cannot disable collisons.
[ WARN] [1644262529.647240364]: Link 'panda_link8_sc' is not known to URDF. Cannot disable collisons.
[ WARN] [1644262529.647256477]: Link 'panda_link8_sc' is not known to URDF. Cannot disable collisons.
[ WARN] [1644262529.647270295]: Link 'panda_link8_sc' is not known to URDF. Cannot disable collisons.
[ WARN] [1644262529.647284219]: Link 'panda_link8_sc' is not known to URDF. Cannot disable collisons.
[ WARN] [1644262529.647296753]: Link 'panda_link8_sc' is not known to URDF. Cannot disable collisons.
[ WARN] [1644262529.647333173]: Link 'panda_hand_sc' is not known to URDF. Cannot disable collisons.
[ WARN] [1644262529.647361510]: Link 'panda_hand_sc' is not known to URDF. Cannot disable collisons.
[ INFO] [1644262529.647537810]: Loading robot model 'panda'...
[ WARN] [1644262529.647744382]: Link panda_leftfinger has visual geometry but no collision geometry. Collision geometry will be left empty. Fix your URDF file by explicitly specifying collision geometry.
[ WARN] [1644262529.647787841]: Link panda_rightfinger has visual geometry but no collision geometry. Collision geometry will be left empty. Fix your URDF file by explicitly specifying collision geometry.
[ WARN] [1644262529.648011708]: Group 'manipulator' must have at least one valid joint
[ WARN] [1644262529.648044860]: Failed to add group 'manipulator'
[ERROR] [1644262529.648169000]: Group state 'ready' specified for group 'manipulator', but that group does not exist
[ERROR] [1644262529.648193135]: Group state 'extended' specified for group 'manipulator', but that group does not exist
[ INFO] [1644262529.738328044]: Publishing maintained planning scene on 'monitored_planning_scene'
[ INFO] [1644262529.741363760]: Listening to 'joint_states' for joint states
[ INFO] [1644262529.746310131]: Listening to '/attached_collision_object' for attached collision objects
[ INFO] [1644262529.746410625]: Starting planning scene monitor
[ INFO] [1644262529.748972487]: Listening to '/planning_scene'
[ INFO] [1644262529.749039179]: Starting world geometry update monitor for collision objects, attached objects, octomap updates.
[ INFO] [1644262529.754676352]: Listening to '/collision_object'
[ INFO] [1644262529.756960791]: Listening to '/planning_scene_world' for planning scene world geometry
[ INFO] [1644262529.757859545]: No 3D sensor plugin(s) defined for octomap updates
[ INFO] [1644262529.759127868]: Loading planning pipeline 'chomp'
[ERROR] [1644262529.761756215]: Exception while loading planner 'chomp_interface/CHOMPPlanner': According to the loaded plugin descriptions the class chomp_interface/CHOMPPlanner with base class type planning_interface::PlannerManager does not exist. Declared types are  lerp_interface/LERPPlanner ompl_interface/OMPLPlanner
Available plugins: lerp_interface/LERPPlanner, ompl_interface/OMPLPlanner
[ INFO] [1644262529.766224328]: Param 'default_workspace_bounds' was not set. Using default value: 10
[ INFO] [1644262529.766836441]: Param 'start_state_max_bounds_error' was set to 0.1
[ INFO] [1644262529.767328463]: Param 'start_state_max_dt' was not set. Using default value: 0.5
[ INFO] [1644262529.767855585]: Param 'start_state_max_dt' was not set. Using default value: 0.5
[ INFO] [1644262529.768421041]: Param 'jiggle_fraction' was set to 0.05
[ INFO] [1644262529.769237613]: Param 'max_sampling_attempts' was not set. Using default value: 100
[ INFO] [1644262529.769351337]: Using planning request adapter 'Add Time Parameterization'
[ INFO] [1644262529.769398999]: Using planning request adapter 'Resolve constraint frames to robot links'
[ INFO] [1644262529.769431178]: Using planning request adapter 'Fix Workspace Bounds'
[ INFO] [1644262529.769461905]: Using planning request adapter 'Fix Start State Bounds'
[ INFO] [1644262529.769496618]: Using planning request adapter 'Fix Start State In Collision'
[ INFO] [1644262529.769527450]: Using planning request adapter 'Fix Start State Path Constraints'
[ERROR] [1644262529.770938669]: Failed to initialize planning pipeline 'chomp'.
[ INFO] [1644262529.772247198]: Loading planning pipeline 'ompl'
[ INFO] [1644262529.790590796]: rviz version 1.14.11
[ INFO] [1644262529.791016449]: compiled against Qt version 5.12.8
[ INFO] [1644262529.791044478]: compiled against OGRE version 1.9.0 (Ghadamon)
[ INFO] [1644262529.801784181]: Forcing OpenGl version 0.
[ INFO] [1644262529.857146103]: Using planning interface 'OMPL'
[ INFO] [1644262529.859381987]: Param 'default_workspace_bounds' was not set. Using default value: 10
[ INFO] [1644262529.859932525]: Param 'start_state_max_bounds_error' was set to 0.1
[ INFO] [1644262529.860680621]: Param 'start_state_max_dt' was not set. Using default value: 0.5
[ INFO] [1644262529.861191958]: Param 'start_state_max_dt' was not set. Using default value: 0.5
[ INFO] [1644262529.862871977]: Param 'jiggle_fraction' was set to 0.05
[ INFO] [1644262529.863466514]: Param 'max_sampling_attempts' was not set. Using default value: 100
[ INFO] [1644262529.863542674]: Using planning request adapter 'Add Time Parameterization'
[ INFO] [1644262529.863562271]: Using planning request adapter 'Resolve constraint frames to robot links'
[ INFO] [1644262529.863580114]: Using planning request adapter 'Fix Workspace Bounds'
[ INFO] [1644262529.863593804]: Using planning request adapter 'Fix Start State Bounds'
[ INFO] [1644262529.863607555]: Using planning request adapter 'Fix Start State In Collision'
[ INFO] [1644262529.863620401]: Using planning request adapter 'Fix Start State Path Constraints'
[ INFO] [1644262529.865579769]: Loading planning pipeline 'pilz_industrial_motion_planner'
[ERROR] [1644262529.867970749]: Exception while loading planner 'pilz_industrial_motion_planner::CommandPlanner': According to the loaded plugin descriptions the class pilz_industrial_motion_planner::CommandPlanner with base class type planning_interface::PlannerManager does not exist. Declared types are  lerp_interface/LERPPlanner ompl_interface/OMPLPlanner
Available plugins: lerp_interface/LERPPlanner, ompl_interface/OMPLPlanner
[ERROR] [1644262529.868055512]: Failed to initialize planning pipeline 'pilz_industrial_motion_planner'.
[ERROR] [1644262529.878495526]: Link 'panda_hand_tcp' declared as part of a chain in group 'manipulator' is not known to the URDF
[ WARN] [1644262529.878622002]: Group 'manipulator' is empty.
[ERROR] [1644262529.878787680]: Link 'panda_hand_tcp' specified as parent for end effector 'hand_tcp' is not known to the URDF
[ WARN] [1644262529.878834057]: Link 'panda_link0_sc' is not known to URDF. Cannot disable collisons.
[ WARN] [1644262529.878853963]: Link 'panda_link0_sc' is not known to URDF. Cannot disable collisons.
[ WARN] [1644262529.878871554]: Link 'panda_link0_sc' is not known to URDF. Cannot disable collisons.
[ WARN] [1644262529.878888009]: Link 'panda_link0_sc' is not known to URDF. Cannot disable collisons.
[ WARN] [1644262529.878903044]: Link 'panda_link0_sc' is not known to URDF. Cannot disable collisons.
[ WARN] [1644262529.878917520]: Link 'panda_link0_sc' is not known to URDF. Cannot disable collisons.
[ WARN] [1644262529.878932986]: Link 'panda_link0_sc' is not known to URDF. Cannot disable collisons.
[ WARN] [1644262529.878948684]: Link 'panda_link0_sc' is not known to URDF. Cannot disable collisons.
[ WARN] [1644262529.878963500]: Link 'panda_link0_sc' is not known to URDF. Cannot disable collisons.
[ WARN] [1644262529.878989836]: Link 'panda_link1_sc' is not known to URDF. Cannot disable collisons.
[ WARN] [1644262529.879006187]: Link 'panda_link1_sc' is not known to URDF. Cannot disable collisons.
.
.
.
[ WARN] [1644262529.880348976]: Link 'panda_link8_sc' is not known to URDF. Cannot disable collisons.
[ WARN] [1644262529.880365284]: Link 'panda_link8_sc' is not known to URDF. Cannot disable collisons.
[ WARN] [1644262529.880381794]: Link 'panda_link8_sc' is not known to URDF. Cannot disable collisons.
[ WARN] [1644262529.880398601]: Link 'panda_link8_sc' is not known to URDF. Cannot disable collisons.
[ WARN] [1644262529.880416034]: Link 'panda_link8_sc' is not known to URDF. Cannot disable collisons.
[ WARN] [1644262529.880432575]: Link 'panda_link8_sc' is not known to URDF. Cannot disable collisons.
[ WARN] [1644262529.880474292]: Link 'panda_hand_sc' is not known to URDF. Cannot disable collisons.
[ WARN] [1644262529.880502356]: Link 'panda_hand_sc' is not known to URDF. Cannot disable collisons.
[ INFO] [1644262529.880574724]: Loading robot model 'panda'...
[ WARN] [1644262529.880694955]: Link panda_leftfinger has visual geometry but no collision geometry. Collision geometry will be left empty. Fix your URDF file by explicitly specifying collision geometry.
[ WARN] [1644262529.880723390]: Link panda_rightfinger has visual geometry but no collision geometry. Collision geometry will be left empty. Fix your URDF file by explicitly specifying collision geometry.
[ WARN] [1644262529.880812374]: Group 'manipulator' must have at least one valid joint
[ WARN] [1644262529.880833247]: Failed to add group 'manipulator'
[ERROR] [1644262529.880913331]: Group state 'ready' specified for group 'manipulator', but that group does not exist
[ERROR] [1644262529.880934594]: Group state 'extended' specified for group 'manipulator', but that group does not exist
[ INFO] [1644262529.921057474]: Set joints of group 'panda_arm' to pose 'ready'.
[ INFO] [1644262529.921100164]: Set joints of group 'hand' to pose 'open'.
[ INFO] [1644262529.921322285]: Fake controller 'fake_panda_arm_controller' with joints [ panda_joint1 panda_joint2 panda_joint3 panda_joint4 panda_joint5 panda_joint6 panda_joint7 ]
[ INFO] [1644262529.921683644]: Fake controller 'fake_hand_controller' with joints [ panda_finger_joint1 ]
[ INFO] [1644262529.921961756]: Fake controller 'fake_panda_arm_hand_controller' with joints [ panda_joint1 panda_joint2 panda_joint3 panda_joint4 panda_joint5 panda_joint6 panda_joint7 panda_finger_joint1 ]
[ INFO] [1644262529.922285877]: Returned 3 controllers in list
[ INFO] [1644262529.934815681]: Trajectory execution is managing controllers
[ INFO] [1644262529.934855674]: MoveGroup debug mode is ON

Recommend Projects

  • React photo React

    A declarative, efficient, and flexible JavaScript library for building user interfaces.

  • Vue.js photo Vue.js

    ๐Ÿ–– Vue.js is a progressive, incrementally-adoptable JavaScript framework for building UI on the web.

  • Typescript photo Typescript

    TypeScript is a superset of JavaScript that compiles to clean JavaScript output.

  • TensorFlow photo TensorFlow

    An Open Source Machine Learning Framework for Everyone

  • Django photo Django

    The Web framework for perfectionists with deadlines.

  • D3 photo D3

    Bring data to life with SVG, Canvas and HTML. ๐Ÿ“Š๐Ÿ“ˆ๐ŸŽ‰

Recommend Topics

  • javascript

    JavaScript (JS) is a lightweight interpreted programming language with first-class functions.

  • web

    Some thing interesting about web. New door for the world.

  • server

    A server is a program made to process requests and deliver data to clients.

  • Machine learning

    Machine learning is a way of modeling and interpreting data that allows a piece of software to respond intelligently.

  • Game

    Some thing interesting about game, make everyone happy.

Recommend Org

  • Facebook photo Facebook

    We are working to build community through open source technology. NB: members must have two-factor auth.

  • Microsoft photo Microsoft

    Open source projects and samples from Microsoft.

  • Google photo Google

    Google โค๏ธ Open Source for everyone.

  • D3 photo D3

    Data-Driven Documents codes.