Package Summary

Tags No category tags.
Version 0.6.6
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-planning/moveit_ros.git
VCS Type git
VCS Version jade-devel
Last Updated 2016-08-05
Dev Status MAINTAINED
CI status No Continuous Integration
Released UNRELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Planning components of MoveIt that use ROS

Additional Links

Maintainers

  • Sachin Chitta
  • Ioan Sucan
  • Michael Ferguson

Authors

  • Ioan Sucan
  • Sachin Chitta
README
No README found. See repository README.
CHANGELOG

Changelog for package moveit_ros_planning

0.6.6 (2016-06-08)

  • Add library moveit_collision_plugin_loader as an exported catkin library (#678)
  • replaced cmake_modules dependency with eigen
  • [jade] eigen3 adjustment
  • Fix compilation with C++11.
  • Enable optional build against Qt5, use -DUseQt5=On to enable it
  • merge indigo-devel changes (PR #633 trailing whitespace) into jade-devel
  • Removed trailing whitespace from entire repository
  • Optional ability to copy velocity and effort to RobotState
  • cherry-picked PR #614 fixed segfault on shutdown
  • fixed segfault on shutdown use of pluginlib\'s createUnmanagedInstance() is strongly discouraged: http://wiki.ros.org/class_loader#Understanding_Loading_and_Unloading here, the kinematics plugin libs were unloaded before destruction of corresponding pointers
  • Deprecate shape_tools
  • CurrentStateMonitor no longer requires hearing mimic joint state values.
  • Fix crash due to robot state not getting updated (moveit_ros #559)
  • Contributors: Dave Coleman, Dave Hershberger, Isaac I.Y. Saito, Levi Armstrong, Maarten de Vries, Robert Haschke, Simon Schmeisser (isys vision), kohlbrecher

0.6.5 (2015-01-24)

  • update maintainers
  • perception: adding RAII-based locking for OccMapTree
  • perception: adding locks to planning scene monitor
  • Add time factor support for iterative_time_parametrization
  • Contributors: Jonathan Bohren, Michael Ferguson, kohlbrecher

0.6.4 (2014-12-20)

  • Namespaced \"traj_execution\" for all trajectory_execution_manager logging
  • planning_scene_monitor: add ros parameter for adding a wait-for-transform lookup time fixes #465
  • Contributors: Dave Coleman, Jonathan Bohren

0.6.3 (2014-12-03)

  • add plugin interface for collision detectors
  • fix missing return value
  • trivial fixes for warnings
  • Contributors: Michael Ferguson

0.6.2 (2014-10-31)

0.6.1 (2014-10-31)

  • re-add libqt4 dependency (previously came from pcl-all)
  • Contributors: Michael Ferguson

0.6.0 (2014-10-27)

  • Removed leadings slash from rosparam for robot padding
  • Added move_group capability for clearing octomap.
  • Made loading octomap_monitor optional in planning_scene_monitor when using WorldGeometryMonitor
  • Contributors: Dave Coleman, Dave Hershberger, Sachin Chitta, ahb

0.5.19 (2014-06-23)

  • Updated doxygen comment in TrajectoryExecutionManager.
  • Added more informative error message text when cant\' find controllers.
  • robot_model_loader.cpp: added call to KinematicsBase::supportsGroup().
  • Fix [-Wreorder] warning.
  • Fix broken log & output statements.
    • Address [cppcheck: coutCerrMisusage] and [-Werror=format-extra-args] errors.
    • ROS_ERROR -> ROS_ERROR_NAMED.
    • Print size_t values portably.
  • Address [-Wreturn-type] warning.
  • Address [cppcheck: postfixOperator] warning.
  • Address [cppcheck: duplicateIf] error. The same condition was being checked twice, and the same action was being taken.
  • Add check for planning scene monitor connection, with 5 sec delay
  • Fix for building srv_kinematics_plugin
  • New ROS service call-based IK plugin
  • Allow planning groups to have more than one tip
  • Contributors: Adolfo Rodriguez Tsouroukdissian, Dave Coleman, Dave Hershberger

0.5.18 (2014-03-23)

0.5.17 (2014-03-22)

  • update build system for ROS indigo
  • update maintainer e-mail
  • Namespace a debug message
  • Minor non-functional changes to KDL
  • Contributors: Dave Coleman, Ioan Sucan

0.5.16 (2014-02-27)

  • Copy paste error fix
  • Contributors: fivef

0.5.14 (2014-02-06)

0.5.13 (2014-02-06)

  • remove debug printfs
  • planning_scene_monitor: add requestPlanningSceneState()
  • planning_scene_monitor: fix race condition
  • planning_scene_monitor: fix state update bug The rate of state updates is limited to dt_state_update per second. When an update arrived it was not processed if another was recently processed. This meant that if a quick sequence of state updates arrived and then no updates arrive for a while that the last update(s) were not seen until another arrives (which may be much later or never). This fixes the bug by periodically checking for pending updates and running them if they have been pending longer than dt_state_update.
  • add default_robot_link_padding/scale, set padding/scale value for each robot link, see https://github.com/ros-planning/moveit_ros/issues/402
  • fix LockedPlanningSceneRW docs fix the text that was originally copied from another class (from LockedPlanningSceneRO) it mentioned an incorrect return value type of LockedPlanningSceneRW::operator->()
  • Contributors: Acorn Pooley, Filip Jares, Kei Okada

0.5.12 (2014-01-03)

  • Fixed trailing underscores in CHANGELOGs.
  • Contributors: Dave Hershberger

0.5.11 (2014-01-03)

  • planning_scene_monitor: slight code simplification
  • planning_scene_monitor: fix scope of local vars
  • planning_scene_monitor: fix init bug scene_const_ not set if scene passed to constructor.
  • kdl_kinematics_plugin: fix warning
  • Contributors: Acorn Pooley

0.5.10 (2013-12-08)

  • fixing how joint names are filled up, fixed joints were getting included earlier, also resizing consistency limits for when random positions near by function is being called
  • Contributors: Sachin Chitta

0.5.9 (2013-12-03)

  • Doxygen: added warnings and details to planning_scene_monitor.h
  • correcting maintainer email
  • remove duplicate header
  • Fixed exported targets
  • Fixed dependency issue
  • fixing joint limits setup for mimic joints
  • implement feature requests
  • clear monitored octomap when needed (see #315)
  • fix the adapter for fixing path constraints for initial states
  • fixed computation of dimension_.
  • bugfixes in indexing added states for path adapters
  • fixes for mimic joints and redundant joints

0.5.8 (2013-10-11)

  • add executable for publishing scene geometry from text
  • Made the goal duration margin and scaling optional rosparameters
  • bugfixes

0.5.7 (2013-10-01)

0.5.6 (2013-09-26)

0.5.5 (2013-09-23)

  • fix the event triggered on updating attached objects
  • make scene monitor trigger updates only when needed
  • fix loading of default params
  • port to new RobotState API, new messages
  • make sure we do not overwrite attached bodies, when updating the current state
  • fix #308
  • fix #304
  • fix issue with sending trajectories for passive/mimic/fixed joints
  • pass effort along

0.5.4 (2013-08-14)

  • remove CollisionMap, expose topic names in PlanningSceneMonitor, implement detach / attach operations as requested by #280
  • make headers and author definitions aligned the same way; white space fixes
  • move background_processing lib to core
  • add option to disable trajectory monitoring

0.5.2 (2013-07-15)

0.5.1 (2013-07-14)

0.5.0 (2013-07-12)

  • minor doc fixes
  • add docs for planning pipeline
  • cleanup build system
  • fixing approximate ik calculation
  • white space fixes (tabs are now spaces)
  • adding check for approximate solution flag
  • adding options struct to kinematics base
  • port to new base class for planning_interface (using planning contexts)

0.4.5 (2013-07-03)

  • Namespaced ROS* log messages for better debug fitering - added \'kdl\' namespace
  • remove dep
  • make searchPositionIK actually const, and thread-safe
  • Made debug output look better

0.4.4 (2013-06-26)

  • fix #210
  • added dynamic reconfigure parameters to allow enabling/disabling of trajectory duration monitoring. fixes #256
  • add state operations evaluation tool
  • warn when time parametrization fails
  • moved exceptions headers

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Dependant Packages

Name Repo Deps
force_torque_sensor_calib github-kth-ros-pkg-force_torque_tools
industrial_trajectory_filters github-ros-industrial-industrial_core
moveit_kinematics github-ros-planning-moveit
moveit_planners_ompl github-ros-planning-moveit
moveit_planners_ompl github-ros-planning-moveit_planners
moveit_fake_controller_manager github-ros-planning-moveit
moveit_fake_controller_manager github-ros-planning-moveit_plugins
moveit_ros_benchmarks github-ros-planning-moveit
moveit_ros_benchmarks github-ros-planning-moveit_ros
moveit_ros_benchmarks_gui github-ros-planning-moveit
moveit_ros_benchmarks_gui github-ros-planning-moveit_ros
moveit_ros_manipulation github-ros-planning-moveit
moveit_ros_manipulation github-ros-planning-moveit_ros
moveit_ros_move_group github-ros-planning-moveit
moveit_ros_move_group github-ros-planning-moveit_ros
moveit_ros github-ros-planning-moveit
moveit_ros github-ros-planning-moveit_ros
moveit_ros_planning_interface github-ros-planning-moveit
moveit_ros_planning_interface github-ros-planning-moveit_ros
moveit_ros_robot_interaction github-ros-planning-moveit
moveit_ros_robot_interaction github-ros-planning-moveit_ros
moveit_ros_warehouse github-ros-planning-moveit
moveit_ros_warehouse github-ros-planning-moveit_ros
moveit_runtime github-ros-planning-moveit
moveit_setup_assistant github-ros-planning-moveit
moveit_setup_assistant github-ros-planning-moveit_setup_assistant
moveit_sim_controller github-davetcoleman-moveit_sim_controller
moveit_sim_controller github-PickNikRobotics-moveit_sim_controller
hand_kinematics github-shadow-robot-sr_interface
sr_robot_commander github-shadow-robot-sr_interface
aubo_kinematics github-auboliuxin-aubo_robot
aubo_trajectory_filters github-auboliuxin-aubo_robot

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Recent questions tagged moveit_ros_planning at answers.ros.org

Package Summary

Tags No category tags.
Version 0.7.2
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-planning/moveit_ros.git
VCS Type git
VCS Version indigo-devel
Last Updated 2016-08-05
Dev Status MAINTAINED
CI status No Continuous Integration
Released UNRELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Planning components of MoveIt that use ROS

Additional Links

Maintainers

  • Sachin Chitta
  • Ioan Sucan
  • Michael Ferguson

Authors

  • Ioan Sucan
  • Sachin Chitta
README
No README found. See repository README.
CHANGELOG

Changelog for package moveit_ros_planning

0.7.2 (2016-06-20)

  • apply planning scene: use newly exposed success value of newPlanningSceneMessage
  • simplify newPlanningSceneMessage
  • monitor: make newPlanningSceneMessage public This is required for capabilities to update the planning scene. ABI-compatible.
  • Add library moveit_collision_plugin_loader as an exported catkin library (#677)
  • Contributors: Levi Armstrong, v4hn

0.7.1 (2016-04-11)

  • Adding acceleration scaling factor
  • Contributors: hemes

0.7.0 (2016-01-30)

  • Removed trailing whitespace from entire repository
  • fixed segfault on shutdown use of pluginlib\'s createUnmanagedInstance() is strongly discouraged: http://wiki.ros.org/class_loader#Understanding_Loading_and_Unloading here, the kinematics plugin libs were unloaded before destruction of corresponding pointers
  • Deprecate shape_tools
  • CurrentStateMonitor no longer requires hearing mimic joint state values.
  • Fix crash due to robot state not getting updated (moveit_ros #559)
  • Contributors: Dave Coleman, Dave Hershberger, Robert Haschke, kohlbrecher

0.6.5 (2015-01-24)

  • update maintainers
  • perception: adding RAII-based locking for OccMapTree
  • perception: adding locks to planning scene monitor
  • Add time factor support for iterative_time_parametrization
  • Contributors: Jonathan Bohren, Michael Ferguson, kohlbrecher

0.6.4 (2014-12-20)

  • Namespaced \"traj_execution\" for all trajectory_execution_manager logging
  • planning_scene_monitor: add ros parameter for adding a wait-for-transform lookup time fixes #465
  • Contributors: Dave Coleman, Jonathan Bohren

0.6.3 (2014-12-03)

  • add plugin interface for collision detectors
  • fix missing return value
  • trivial fixes for warnings
  • Contributors: Michael Ferguson

0.6.2 (2014-10-31)

0.6.1 (2014-10-31)

  • re-add libqt4 dependency (previously came from pcl-all)
  • Contributors: Michael Ferguson

0.6.0 (2014-10-27)

  • Removed leadings slash from rosparam for robot padding
  • Added move_group capability for clearing octomap.
  • Made loading octomap_monitor optional in planning_scene_monitor when using WorldGeometryMonitor
  • Contributors: Dave Coleman, Dave Hershberger, Sachin Chitta, ahb

0.5.19 (2014-06-23)

  • Updated doxygen comment in TrajectoryExecutionManager.
  • Added more informative error message text when cant\' find controllers.
  • robot_model_loader.cpp: added call to KinematicsBase::supportsGroup().
  • Fix [-Wreorder] warning.
  • Fix broken log & output statements.
    • Address [cppcheck: coutCerrMisusage] and [-Werror=format-extra-args] errors.
    • ROS_ERROR -> ROS_ERROR_NAMED.
    • Print size_t values portably.
  • Address [-Wreturn-type] warning.
  • Address [cppcheck: postfixOperator] warning.
  • Address [cppcheck: duplicateIf] error. The same condition was being checked twice, and the same action was being taken.
  • Add check for planning scene monitor connection, with 5 sec delay
  • Fix for building srv_kinematics_plugin
  • New ROS service call-based IK plugin
  • Allow planning groups to have more than one tip
  • Contributors: Adolfo Rodriguez Tsouroukdissian, Dave Coleman, Dave Hershberger

0.5.18 (2014-03-23)

0.5.17 (2014-03-22)

  • update build system for ROS indigo
  • update maintainer e-mail
  • Namespace a debug message
  • Minor non-functional changes to KDL
  • Contributors: Dave Coleman, Ioan Sucan

0.5.16 (2014-02-27)

  • Copy paste error fix
  • Contributors: fivef

0.5.14 (2014-02-06)

0.5.13 (2014-02-06)

  • remove debug printfs
  • planning_scene_monitor: add requestPlanningSceneState()
  • planning_scene_monitor: fix race condition
  • planning_scene_monitor: fix state update bug The rate of state updates is limited to dt_state_update per second. When an update arrived it was not processed if another was recently processed. This meant that if a quick sequence of state updates arrived and then no updates arrive for a while that the last update(s) were not seen until another arrives (which may be much later or never). This fixes the bug by periodically checking for pending updates and running them if they have been pending longer than dt_state_update.
  • add default_robot_link_padding/scale, set padding/scale value for each robot link, see https://github.com/ros-planning/moveit_ros/issues/402
  • fix LockedPlanningSceneRW docs fix the text that was originally copied from another class (from LockedPlanningSceneRO) it mentioned an incorrect return value type of LockedPlanningSceneRW::operator->()
  • Contributors: Acorn Pooley, Filip Jares, Kei Okada

0.5.12 (2014-01-03)

  • Fixed trailing underscores in CHANGELOGs.
  • Contributors: Dave Hershberger

0.5.11 (2014-01-03)

  • planning_scene_monitor: slight code simplification
  • planning_scene_monitor: fix scope of local vars
  • planning_scene_monitor: fix init bug scene_const_ not set if scene passed to constructor.
  • kdl_kinematics_plugin: fix warning
  • Contributors: Acorn Pooley

0.5.10 (2013-12-08)

  • fixing how joint names are filled up, fixed joints were getting included earlier, also resizing consistency limits for when random positions near by function is being called
  • Contributors: Sachin Chitta

0.5.9 (2013-12-03)

  • Doxygen: added warnings and details to planning_scene_monitor.h
  • correcting maintainer email
  • remove duplicate header
  • Fixed exported targets
  • Fixed dependency issue
  • fixing joint limits setup for mimic joints
  • implement feature requests
  • clear monitored octomap when needed (see #315)
  • fix the adapter for fixing path constraints for initial states
  • fixed computation of dimension_.
  • bugfixes in indexing added states for path adapters
  • fixes for mimic joints and redundant joints

0.5.8 (2013-10-11)

  • add executable for publishing scene geometry from text
  • Made the goal duration margin and scaling optional rosparameters
  • bugfixes

0.5.7 (2013-10-01)

0.5.6 (2013-09-26)

0.5.5 (2013-09-23)

  • fix the event triggered on updating attached objects
  • make scene monitor trigger updates only when needed
  • fix loading of default params
  • port to new RobotState API, new messages
  • make sure we do not overwrite attached bodies, when updating the current state
  • fix #308
  • fix #304
  • fix issue with sending trajectories for passive/mimic/fixed joints
  • pass effort along

0.5.4 (2013-08-14)

  • remove CollisionMap, expose topic names in PlanningSceneMonitor, implement detach / attach operations as requested by #280
  • make headers and author definitions aligned the same way; white space fixes
  • move background_processing lib to core
  • add option to disable trajectory monitoring

0.5.2 (2013-07-15)

0.5.1 (2013-07-14)

0.5.0 (2013-07-12)

  • minor doc fixes
  • add docs for planning pipeline
  • cleanup build system
  • fixing approximate ik calculation
  • white space fixes (tabs are now spaces)
  • adding check for approximate solution flag
  • adding options struct to kinematics base
  • port to new base class for planning_interface (using planning contexts)

0.4.5 (2013-07-03)

  • Namespaced ROS* log messages for better debug fitering - added \'kdl\' namespace
  • remove dep
  • make searchPositionIK actually const, and thread-safe
  • Made debug output look better

0.4.4 (2013-06-26)

  • fix #210
  • added dynamic reconfigure parameters to allow enabling/disabling of trajectory duration monitoring. fixes #256
  • add state operations evaluation tool
  • warn when time parametrization fails
  • moved exceptions headers

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Dependant Packages

Name Repo Deps
cob_collision_monitor github-ipa320-cob_manipulation
vs060 github-start-jsk-denso
force_torque_sensor_calib github-kth-ros-pkg-force_torque_tools
industrial_trajectory_filters github-ros-industrial-industrial_core
moveit_kinematics github-ros-planning-moveit
moveit_planners_ompl github-ros-planning-moveit
moveit_planners_ompl github-ros-planning-moveit_planners
moveit_fake_controller_manager github-ros-planning-moveit
moveit_fake_controller_manager github-ros-planning-moveit_plugins
moveit_ros_benchmarks github-ros-planning-moveit
moveit_ros_benchmarks github-ros-planning-moveit_ros
moveit_ros_benchmarks_gui github-ros-planning-moveit
moveit_ros_benchmarks_gui github-ros-planning-moveit_ros
moveit_ros_manipulation github-ros-planning-moveit
moveit_ros_manipulation github-ros-planning-moveit_ros
moveit_ros_move_group github-ros-planning-moveit
moveit_ros_move_group github-ros-planning-moveit_ros
moveit_ros github-ros-planning-moveit
moveit_ros github-ros-planning-moveit_ros
moveit_ros_planning_interface github-ros-planning-moveit
moveit_ros_planning_interface github-ros-planning-moveit_ros
moveit_ros_robot_interaction github-ros-planning-moveit
moveit_ros_robot_interaction github-ros-planning-moveit_ros
moveit_ros_warehouse github-ros-planning-moveit
moveit_ros_warehouse github-ros-planning-moveit_ros
moveit_runtime github-ros-planning-moveit
moveit_setup_assistant github-ros-planning-moveit
moveit_setup_assistant github-ros-planning-moveit_setup_assistant
pr2_moveit_tests github-ros-planning-moveit_pr2
moveit_sim_controller github-davetcoleman-moveit_sim_controller
moveit_sim_controller github-PickNikRobotics-moveit_sim_controller
hand_kinematics github-shadow-robot-sr_interface
sr_robot_commander github-shadow-robot-sr_interface
ur_kinematics github-ros-industrial-universal_robot
descartes_moveit github-ros-industrial-consortium-descartes
moveit_simple_grasps github-davetcoleman-moveit_simple_grasps
aubo_kinematics github-auboliuxin-aubo_robot
aubo_trajectory_filters github-auboliuxin-aubo_robot
fetch_pbd_interaction github-fetchrobotics-fetch_pbd
constrained_ik github-ros-industrial-industrial_moveit
industrial_moveit_benchmarking github-ros-industrial-industrial_moveit
stomp_moveit github-ros-industrial-industrial_moveit
stomp_plugins github-ros-industrial-industrial_moveit
rapid_pbd github-jstnhuang-rapid_pbd
romeo_moveit_actions github-ros-aldebaran-romeo_moveit_actions
tork_moveit_tutorial github-tork-a-tork_moveit_tutorial

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Recent questions tagged moveit_ros_planning at answers.ros.org

Package Summary

Tags No category tags.
Version 0.5.20
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-planning/moveit_ros.git
VCS Type git
VCS Version hydro-devel
Last Updated 2015-04-14
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Planning components of MoveIt that use ROS

Additional Links

Maintainers

  • Sachin Chitta
  • Ioan Sucan

Authors

  • Ioan Sucan
  • Sachin Chitta
README
No README found. See repository README.
CHANGELOG

Changelog for package moveit_ros_planning

0.5.20 (2014-12-09)

  • Made loading octomap_monitor optional in planning_scene_monitor when using WorldGeometryMonitor
  • remove leading \'/\' from DEFAULT_PLANNING_SCENE_SERVICE; otherwise planning_scene_rviz_plugin fails with \'Failed to call service /get_planning_scene ...\' if move_group is in a namespace different from \'/\'
  • Made loading octomap_monitor optional in planning_scene_monitor when using WorldGeometryMonitor
  • service must have access to global namespace
  • Added capability to set max_planning_attempts in GUI. Parallel planner now plans until either the planning_time is reached or until max_planning_attempts are successfull.
  • Contributors: Chris Lewis, Dave Coleman, Sachin Chitta, ahb

0.5.19 (2014-06-23)

  • Updated doxygen comment in TrajectoryExecutionManager.
  • Added more informative error message text when cant\' find controllers.
  • robot_model_loader.cpp: added call to KinematicsBase::supportsGroup().
  • Fix [-Wreorder] warning.
  • Fix broken log & output statements.
    • Address [cppcheck: coutCerrMisusage] and [-Werror=format-extra-args] errors.
    • ROS_ERROR -> ROS_ERROR_NAMED.
    • Print size_t values portably.
  • Address [-Wreturn-type] warning.
  • Address [cppcheck: postfixOperator] warning.
  • Address [cppcheck: duplicateIf] error. The same condition was being checked twice, and the same action was being taken.
  • Add check for planning scene monitor connection, with 5 sec delay
  • Fix for building srv_kinematics_plugin
  • New ROS service call-based IK plugin
  • Allow planning groups to have more than one tip
  • Contributors: Adolfo Rodriguez Tsouroukdissian, Dave Coleman, Dave Hershberger

0.5.18 (2014-03-23)

0.5.17 (2014-03-22)

  • update build system for ROS indigo
  • update maintainer e-mail
  • Namespace a debug message
  • Minor non-functional changes to KDL
  • Contributors: Dave Coleman, Ioan Sucan

0.5.16 (2014-02-27)

  • Copy paste error fix
  • Contributors: fivef

0.5.14 (2014-02-06)

0.5.13 (2014-02-06)

  • remove debug printfs
  • planning_scene_monitor: add requestPlanningSceneState()
  • planning_scene_monitor: fix race condition
  • planning_scene_monitor: fix state update bug The rate of state updates is limited to dt_state_update per second. When an update arrived it was not processed if another was recently processed. This meant that if a quick sequence of state updates arrived and then no updates arrive for a while that the last update(s) were not seen until another arrives (which may be much later or never). This fixes the bug by periodically checking for pending updates and running them if they have been pending longer than dt_state_update.
  • add default_robot_link_padding/scale, set padding/scale value for each robot link, see https://github.com/ros-planning/moveit_ros/issues/402
  • fix LockedPlanningSceneRW docs fix the text that was originally copied from another class (from LockedPlanningSceneRO) it mentioned an incorrect return value type of LockedPlanningSceneRW::operator->()
  • Contributors: Acorn Pooley, Filip Jares, Kei Okada

0.5.12 (2014-01-03)

  • Fixed trailing underscores in CHANGELOGs.
  • Contributors: Dave Hershberger

0.5.11 (2014-01-03)

  • planning_scene_monitor: slight code simplification
  • planning_scene_monitor: fix scope of local vars
  • planning_scene_monitor: fix init bug scene_const_ not set if scene passed to constructor.
  • kdl_kinematics_plugin: fix warning
  • Contributors: Acorn Pooley

0.5.10 (2013-12-08)

  • fixing how joint names are filled up, fixed joints were getting included earlier, also resizing consistency limits for when random positions near by function is being called
  • Contributors: Sachin Chitta

0.5.9 (2013-12-03)

  • Doxygen: added warnings and details to planning_scene_monitor.h
  • correcting maintainer email
  • remove duplicate header
  • Fixed exported targets
  • Fixed dependency issue
  • fixing joint limits setup for mimic joints
  • implement feature requests
  • clear monitored octomap when needed (see #315)
  • fix the adapter for fixing path constraints for initial states
  • fixed computation of dimension_.
  • bugfixes in indexing added states for path adapters
  • fixes for mimic joints and redundant joints

0.5.8 (2013-10-11)

  • add executable for publishing scene geometry from text
  • Made the goal duration margin and scaling optional rosparameters
  • bugfixes

0.5.7 (2013-10-01)

0.5.6 (2013-09-26)

0.5.5 (2013-09-23)

  • fix the event triggered on updating attached objects
  • make scene monitor trigger updates only when needed
  • fix loading of default params
  • port to new RobotState API, new messages
  • make sure we do not overwrite attached bodies, when updating the current state
  • fix #308
  • fix #304
  • fix issue with sending trajectories for passive/mimic/fixed joints
  • pass effort along

0.5.4 (2013-08-14)

  • remove CollisionMap, expose topic names in PlanningSceneMonitor, implement detach / attach operations as requested by #280
  • make headers and author definitions aligned the same way; white space fixes
  • move background_processing lib to core
  • add option to disable trajectory monitoring

0.5.2 (2013-07-15)

0.5.1 (2013-07-14)

0.5.0 (2013-07-12)

  • minor doc fixes
  • add docs for planning pipeline
  • cleanup build system
  • fixing approximate ik calculation
  • white space fixes (tabs are now spaces)
  • adding check for approximate solution flag
  • adding options struct to kinematics base
  • port to new base class for planning_interface (using planning contexts)

0.4.5 (2013-07-03)

  • Namespaced ROS* log messages for better debug fitering - added \'kdl\' namespace
  • remove dep
  • make searchPositionIK actually const, and thread-safe
  • Made debug output look better

0.4.4 (2013-06-26)

  • fix #210
  • added dynamic reconfigure parameters to allow enabling/disabling of trajectory duration monitoring. fixes #256
  • add state operations evaluation tool
  • warn when time parametrization fails
  • moved exceptions headers

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Recent questions tagged moveit_ros_planning at answers.ros.org

Package Summary

Tags No category tags.
Version 0.6.6
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-planning/moveit_ros.git
VCS Type git
VCS Version kinetic-devel
Last Updated 2016-08-05
Dev Status MAINTAINED
CI status No Continuous Integration
Released UNRELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Planning components of MoveIt that use ROS

Additional Links

Maintainers

  • Sachin Chitta
  • Ioan Sucan
  • Michael Ferguson

Authors

  • Ioan Sucan
  • Sachin Chitta
README
No README found. See repository README.
CHANGELOG

Changelog for package moveit_ros_planning

0.6.6 (2016-06-08)

  • Add library moveit_collision_plugin_loader as an exported catkin library (#678)
  • replaced cmake_modules dependency with eigen
  • [jade] eigen3 adjustment
  • Fix compilation with C++11.
  • Enable optional build against Qt5, use -DUseQt5=On to enable it
  • merge indigo-devel changes (PR #633 trailing whitespace) into jade-devel
  • Removed trailing whitespace from entire repository
  • Optional ability to copy velocity and effort to RobotState
  • cherry-picked PR #614 fixed segfault on shutdown
  • fixed segfault on shutdown use of pluginlib\'s createUnmanagedInstance() is strongly discouraged: http://wiki.ros.org/class_loader#Understanding_Loading_and_Unloading here, the kinematics plugin libs were unloaded before destruction of corresponding pointers
  • Deprecate shape_tools
  • CurrentStateMonitor no longer requires hearing mimic joint state values.
  • Fix crash due to robot state not getting updated (moveit_ros #559)
  • Contributors: Dave Coleman, Dave Hershberger, Isaac I.Y. Saito, Levi Armstrong, Maarten de Vries, Robert Haschke, Simon Schmeisser (isys vision), kohlbrecher

0.6.5 (2015-01-24)

  • update maintainers
  • perception: adding RAII-based locking for OccMapTree
  • perception: adding locks to planning scene monitor
  • Add time factor support for iterative_time_parametrization
  • Contributors: Jonathan Bohren, Michael Ferguson, kohlbrecher

0.6.4 (2014-12-20)

  • Namespaced \"traj_execution\" for all trajectory_execution_manager logging
  • planning_scene_monitor: add ros parameter for adding a wait-for-transform lookup time fixes #465
  • Contributors: Dave Coleman, Jonathan Bohren

0.6.3 (2014-12-03)

  • add plugin interface for collision detectors
  • fix missing return value
  • trivial fixes for warnings
  • Contributors: Michael Ferguson

0.6.2 (2014-10-31)

0.6.1 (2014-10-31)

  • re-add libqt4 dependency (previously came from pcl-all)
  • Contributors: Michael Ferguson

0.6.0 (2014-10-27)

  • Removed leadings slash from rosparam for robot padding
  • Added move_group capability for clearing octomap.
  • Made loading octomap_monitor optional in planning_scene_monitor when using WorldGeometryMonitor
  • Contributors: Dave Coleman, Dave Hershberger, Sachin Chitta, ahb

0.5.19 (2014-06-23)

  • Updated doxygen comment in TrajectoryExecutionManager.
  • Added more informative error message text when cant\' find controllers.
  • robot_model_loader.cpp: added call to KinematicsBase::supportsGroup().
  • Fix [-Wreorder] warning.
  • Fix broken log & output statements.
    • Address [cppcheck: coutCerrMisusage] and [-Werror=format-extra-args] errors.
    • ROS_ERROR -> ROS_ERROR_NAMED.
    • Print size_t values portably.
  • Address [-Wreturn-type] warning.
  • Address [cppcheck: postfixOperator] warning.
  • Address [cppcheck: duplicateIf] error. The same condition was being checked twice, and the same action was being taken.
  • Add check for planning scene monitor connection, with 5 sec delay
  • Fix for building srv_kinematics_plugin
  • New ROS service call-based IK plugin
  • Allow planning groups to have more than one tip
  • Contributors: Adolfo Rodriguez Tsouroukdissian, Dave Coleman, Dave Hershberger

0.5.18 (2014-03-23)

0.5.17 (2014-03-22)

  • update build system for ROS indigo
  • update maintainer e-mail
  • Namespace a debug message
  • Minor non-functional changes to KDL
  • Contributors: Dave Coleman, Ioan Sucan

0.5.16 (2014-02-27)

  • Copy paste error fix
  • Contributors: fivef

0.5.14 (2014-02-06)

0.5.13 (2014-02-06)

  • remove debug printfs
  • planning_scene_monitor: add requestPlanningSceneState()
  • planning_scene_monitor: fix race condition
  • planning_scene_monitor: fix state update bug The rate of state updates is limited to dt_state_update per second. When an update arrived it was not processed if another was recently processed. This meant that if a quick sequence of state updates arrived and then no updates arrive for a while that the last update(s) were not seen until another arrives (which may be much later or never). This fixes the bug by periodically checking for pending updates and running them if they have been pending longer than dt_state_update.
  • add default_robot_link_padding/scale, set padding/scale value for each robot link, see https://github.com/ros-planning/moveit_ros/issues/402
  • fix LockedPlanningSceneRW docs fix the text that was originally copied from another class (from LockedPlanningSceneRO) it mentioned an incorrect return value type of LockedPlanningSceneRW::operator->()
  • Contributors: Acorn Pooley, Filip Jares, Kei Okada

0.5.12 (2014-01-03)

  • Fixed trailing underscores in CHANGELOGs.
  • Contributors: Dave Hershberger

0.5.11 (2014-01-03)

  • planning_scene_monitor: slight code simplification
  • planning_scene_monitor: fix scope of local vars
  • planning_scene_monitor: fix init bug scene_const_ not set if scene passed to constructor.
  • kdl_kinematics_plugin: fix warning
  • Contributors: Acorn Pooley

0.5.10 (2013-12-08)

  • fixing how joint names are filled up, fixed joints were getting included earlier, also resizing consistency limits for when random positions near by function is being called
  • Contributors: Sachin Chitta

0.5.9 (2013-12-03)

  • Doxygen: added warnings and details to planning_scene_monitor.h
  • correcting maintainer email
  • remove duplicate header
  • Fixed exported targets
  • Fixed dependency issue
  • fixing joint limits setup for mimic joints
  • implement feature requests
  • clear monitored octomap when needed (see #315)
  • fix the adapter for fixing path constraints for initial states
  • fixed computation of dimension_.
  • bugfixes in indexing added states for path adapters
  • fixes for mimic joints and redundant joints

0.5.8 (2013-10-11)

  • add executable for publishing scene geometry from text
  • Made the goal duration margin and scaling optional rosparameters
  • bugfixes

0.5.7 (2013-10-01)

0.5.6 (2013-09-26)

0.5.5 (2013-09-23)

  • fix the event triggered on updating attached objects
  • make scene monitor trigger updates only when needed
  • fix loading of default params
  • port to new RobotState API, new messages
  • make sure we do not overwrite attached bodies, when updating the current state
  • fix #308
  • fix #304
  • fix issue with sending trajectories for passive/mimic/fixed joints
  • pass effort along

0.5.4 (2013-08-14)

  • remove CollisionMap, expose topic names in PlanningSceneMonitor, implement detach / attach operations as requested by #280
  • make headers and author definitions aligned the same way; white space fixes
  • move background_processing lib to core
  • add option to disable trajectory monitoring

0.5.2 (2013-07-15)

0.5.1 (2013-07-14)

0.5.0 (2013-07-12)

  • minor doc fixes
  • add docs for planning pipeline
  • cleanup build system
  • fixing approximate ik calculation
  • white space fixes (tabs are now spaces)
  • adding check for approximate solution flag
  • adding options struct to kinematics base
  • port to new base class for planning_interface (using planning contexts)

0.4.5 (2013-07-03)

  • Namespaced ROS* log messages for better debug fitering - added \'kdl\' namespace
  • remove dep
  • make searchPositionIK actually const, and thread-safe
  • Made debug output look better

0.4.4 (2013-06-26)

  • fix #210
  • added dynamic reconfigure parameters to allow enabling/disabling of trajectory duration monitoring. fixes #256
  • add state operations evaluation tool
  • warn when time parametrization fails
  • moved exceptions headers

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Dependant Packages

Name Repo Deps
cob_collision_monitor github-ipa320-cob_manipulation
vs060 github-start-jsk-denso
exotica_core github-ipab-slmc-exotica
force_torque_sensor_calib github-kth-ros-pkg-force_torque_tools
fsrobo_r_trajectory_filters github-FUJISOFT-Robotics-fsrobo_r
industrial_trajectory_filters github-ros-industrial-industrial_core
jog_controller github-tork-a-jog_control
moveit_kinematics github-ros-planning-moveit
moveit_planners_ompl github-ros-planning-moveit
moveit_planners_ompl github-ros-planning-moveit_planners
moveit_fake_controller_manager github-ros-planning-moveit
moveit_fake_controller_manager github-ros-planning-moveit_plugins
moveit_ros_benchmarks github-ros-planning-moveit
moveit_ros_benchmarks github-ros-planning-moveit_ros
moveit_ros_manipulation github-ros-planning-moveit
moveit_ros_manipulation github-ros-planning-moveit_ros
moveit_ros_move_group github-ros-planning-moveit
moveit_ros_move_group github-ros-planning-moveit_ros
moveit_ros github-ros-planning-moveit
moveit_ros github-ros-planning-moveit_ros
moveit_ros_planning_interface github-ros-planning-moveit
moveit_ros_planning_interface github-ros-planning-moveit_ros
moveit_ros_robot_interaction github-ros-planning-moveit
moveit_ros_robot_interaction github-ros-planning-moveit_ros
moveit_ros_warehouse github-ros-planning-moveit
moveit_ros_warehouse github-ros-planning-moveit_ros
moveit_runtime github-ros-planning-moveit
moveit_setup_assistant github-ros-planning-moveit
moveit_setup_assistant github-ros-planning-moveit_setup_assistant
moveit_opw_kinematics_plugin github-JeroenDM-moveit_opw_kinematics_plugin
pr2_moveit_tests github-ros-planning-moveit_pr2
moveit_sim_controller github-davetcoleman-moveit_sim_controller
moveit_sim_controller github-PickNikRobotics-moveit_sim_controller
moveit_visual_tools github-ros-planning-moveit_visual_tools
moveit_visual_tools github-davetcoleman-moveit_visual_tools
open_manipulator_controller github-ROBOTIS-GIT-open_manipulator
open_manipulator_with_tb3_tools github-ROBOTIS-GIT-open_manipulator_with_tb3
pilz_trajectory_generation github-PilzDE-pilz_industrial_motion
prbt_support github-PilzDE-pilz_robots
hand_kinematics github-shadow-robot-sr_interface
sr_robot_commander github-shadow-robot-sr_interface
stomp_moveit github-ros-industrial-stomp_ros
stomp_moveit github-ros-industrial-industrial_moveit
stomp_plugins github-ros-industrial-stomp_ros
stomp_plugins github-ros-industrial-industrial_moveit
ur_kinematics github-ros-industrial-universal_robot
xarm_moveit_servo github-xArm-Developer-xarm_ros
bwi_moveit_utils github-utexas-bwi-bwi_common
descartes_moveit github-ros-industrial-consortium-descartes
moveit_ros_benchmarks_gui github-ros-planning-moveit_ros
moveit_simple_grasps github-davetcoleman-moveit_simple_grasps
aubo_kinematics github-auboliuxin-aubo_robot
aubo_trajectory_filters github-auboliuxin-aubo_robot
constrained_ik github-ros-industrial-industrial_moveit
industrial_moveit_benchmarking github-ros-industrial-industrial_moveit
romeo_moveit_actions github-ros-aldebaran-romeo_moveit_actions
turtlebot3_manipulation_gui github-ROBOTIS-GIT-turtlebot3_manipulation
turtlebot3_manipulation_slam github-ROBOTIS-GIT-turtlebot3_manipulation

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Recent questions tagged moveit_ros_planning at answers.ros.org