- [fix] re-add required build dependencies (#1373)
- [improve] Apply clang tidy fix to entire code base (Part 1) (#1366)
- Contributors: Isaac I.Y. Saito, Robert Haschke, Yu, Yan
- [fix] catkin_lint issues (#1341)
- [fix] memory leaks (#1292)
- [improve] Remove (redundant) random seeding and #attempts from RobotState::setFromIK() as the IK solver perform random seeding themselves. #1288
- [improve] support dark themes (#1173)
- Contributors: Dave Coleman, Robert Haschke, Victor Lamoine
- [enhancement] Create demo_gazebo.launch (#1051)
- [maintenance] Cleanup includes to speedup compiling (#1205)
- [maintenance] Use C++14 (#1146)
- [maintenance] Code Cleanup * #1179 * #1196
- Contributors: Alex Moriarty, Dave Coleman, Michael Görner, Robert Haschke
- [fix] Build regression (#1170)
- Contributors: Robert Haschke
- [fix] compiler warnings (#1089)
- Contributors: Robert Haschke
- [fix] Some bugs (#1022, #1013, #1040)
- [capability][chomp] Failure recovery options for CHOMP by tweaking parameters (#987)
- [capability] New screen for automatically generating interfaces to low level controllers(#951, #994, #908)
- [capability] Perception screen for using laser scanner point clouds. (#969)
- [enhancement][GUI] Logo for MoveIt! 2.0, cleanup appearance (#1059)
- [enhancement][GUI] added a setup assistant window icon (#1028)
- [enhancement][GUI] Planning Groups screen (#1017)
- [enhancement] use panda for test, and write test file in tmp dir (#1042)
- [enhancement] Added capabilties as arg to move_group.launch (#998)
- [enhancement] Add moveit_setup_assistant as depenency of all *_moveit_config pkgs (#1029)
- [maintenance] various compiler warnings (#1038)
- [enhancement] Improving gazebo integration. (#956, #936)
- [maintenance] Renamed wedgits in setup assistant wedgit to follow convention (#995)
- [capability][chomp] cleanup of unused parameters and code + addition of trajectory initialization methods (linear, cubic, quintic-spline) (#960)
- Contributors: Alexander Gutenkunst, Dave Coleman, Mike Lautman, MohmadAyman, Mohmmad Ayman, Raghavender Sahdev, Robert Haschke, Sohieb Abdelrahman, mike lautman
- [maintenance] migration from tf to tf2 API (#830)
- [maintenance] cleanup yaml parsing, remove yaml-cpp 0.3 support (#795)
- [feature] allow editing of xacro args (#796)
- Contributors: Dave Coleman, Ian McMahon, Michael Görner, Mikael Arguedas, Robert Haschke, Will Baker
- [fix][kinetic onward] msa: use qt4-compatible API for default font (#682)
- [fix][kinetic onward] replace explicit use of Arial with default application font (#668)
- [fix] add moveit_fake_controller_manager to run_depend of moveit_config_pkg_template/package.xml.template (#613)
- [fix] find and link against tinyxml where needed (#569)
- Contributors: Kei Okada, Michael Görner, Mikael Arguedas, William Woodall
- [enhance] setup assistant: add use_gui param to demo.launch (#532)
- [build] add Qt-moc guards for boost 1.64 compatibility (#534)
- Contributors: Michael Goerner
- [fix] Build for Ubuntu YZ by adding BOOST_MATH_DISABLE_FLOAT128 (#505)
- [improve][MSA] Open a directory where setup_assistant.launch was started. (#509)
- Contributors: Isaac I.Y. Saito, Mikael Arguedas
- [improve] Add warning if no IK solvers found (#485)
- Contributors: Dave Coleman
- [fix][moveit_ros_warehouse] gcc6 build error #423
- Contributors: Dave Coleman
- [fix] Qt4/Qt5 compatibility #413
- [fix] show disabled collisions as matrix (#394)
- Contributors: Dave Coleman, Robert Haschke, Michael Goerner
- [capability] Exposed planners from latest ompl release. (#338)
- [enhancement] Increase collision checking interval (#337)
- [maintenance] Updated package.xml maintainers and author emails #330
- Contributors: Dave Coleman, Ian McMahon, Ruben Burger
- [Fix] xacro warnings in Kinetic (#334) [Capability] Allows for smaller collision objects at the cost of increased planning time
- [Improve] Increase the default discretization of collision checking motions (#321)
- [Maintenance] Auto format codebase using clang-format (#284)
- Contributors: Dave Coleman
- [sys] Qt adjustment. * relax Qt-version requirement. Minor Qt version updates are ABI-compatible with each other: https://wiki.qt.io/Qt-Version-Compatibility * auto-select Qt version matching the one from rviz #114 * Allow to conditionally compile against Qt5 by setting -DUseQt5=On
- [sys] Add line for supporting CMake 2.8.11 as required for Indigo
- [sys][travis] Update CI conf for ROS Jade (and optionally added Kinetic) #116
- [feat] add ApplyPlanningScene capability to template
- Contributors: Dave Coleman, Isaac I.Y. Saito, Robert Haschke, Simon Schmeisser (isys vision), v4hn
- Merge pull request from ipa-mdl/indigo-devel Added command-line SRDF updater
- renamed target output to collisions_updater
- formatted code to roscpp style
- More verbose error descriptions, use ROS_ERROR_STREAM
- moved file loader helpers into tools
- added licence header
- Missed a negation sign
- CollisionUpdater class was not really needed
- factored out createFullURDFPath and createFullSRDFPath
- factored out MoveItConfigData::getSetupAssistantYAMLPath
- factored out MoveItConfigData::setPackagePath
- factored out setCollisionLinkPairs into MoveItConfigData
- require output path to be set if SRDF path is overwritten by a xacro file path
- separated xacro parsing from loadFileToString
- make disabled_collisions entries unique
- Added command-line SRDF updater
- Merge pull request from 130s/fix/windowsize Shrink window height
- Add scrollbar to the text area that could be squashed.
- Better minimum window size.
- Merge pull request #103 from gavanderhoorn/issue102_cfgrble_db_path Fix for issue #102 : allow user to set mongodb db location
- Update warehouse launch file to accept non-standard db location. Fix #102. Also update generated demo.launch accordingly. The default directory could be located on a non-writable file system, leading to crashes of the mongodb wrapper script. This change allows the user to specify an alternative location using the 'db_path' argument.
- Update configuration_files_widget.cpp Fix link
- Contributors: Dave Coleman, Ioan A Sucan, Isaac IY Saito, Mathias Lüdtke, Nathan Bellowe, Sachin Chitta, gavanderhoorn, hersh
- Values are now read from kinematics.yaml correctly.
- Simplified the inputKinematicsYAML() code.
- Debug and octomap improvements in launch file templates
- Values are now read from kinematics.yaml correctly. Previously, keys such as "kinematics_solver" were not found.
- Added clear octomap service to move_group launch file template
- Added gdb debug helper that allows easier break point addition
- Add launch file for joystick control of MotionPlanningPlugin
- Joint limits comments
- Removed velocity scaling factor
- Added a new 'velocity_scaling_factor' parameter to evenly reduce max joint velocity for all joints. Added documentation.
- Simply renamed kin_model to robot_model for more proper naming convension
- Added new launch file for controll Rviz with joystick
- use relative instead of absolute names for topics (to allow for namespaces)
- Added planner specific parameters to ompl_planning.yaml emitter.
- Added space after every , in function calls Added either a space or a c-return before opening { Moved & next to the variable in the member function declarations
- Added planner specific parameters to ompl_planning.yaml emitter. Each parameter is set to current defaults. This is fragile, as defaults may change.
- Contributors: Chris Lewis, Dave Coleman, Ioan A Sucan, Jim Rothrock, ahb, hersh
- Fixed bug 82 in a quick way by reducing min size.
- Fix for issue #70: support yaml-cpp 0.5+ (new api).
- Generate joint_limits.yaml using ordered joints
- Ensures that group name changes are reflected in the end effectors and robot poses screens as well
- Prevent dirty transforms warning
- Cleaned up stray cout's
- Contributors: Benjamin Chretien, Dave Coleman, Dave Hershberger, Sachin Chitta
- Update move_group.launch Adding get planning scene service to template launch file.
- Fix #42 <moveit/moveit_setup_assistant#42> plus cosmetic param name change.
- Contributors: Acorn, Dave Hershberger, sachinchitta
- Added back-link to tutorial and updated moveit website URL.
- Ported tutorial from wiki to sphinx in source repo.
- Fix compilation on OS X 10.9 (clang)
- Contributors: Nikolaus Demmel, isucan
- fix #64.
- Added Travis Continuous Integration
- Added optional params so user knows they exist - values remain same
- enable publishing more information for demo.launch
- Added 2 deps needed for some of the launch files generated by the setup assistant
- add source param for joint_state_publisher
- Added default octomap_resolution to prevent warning when move_group starts. Added comments.
- generate config files for fake controllers
- port to new robot state API
- make headers and author definitions aligned the same way; white space fixes
- add debug flag to demo.launch template
- default scene alpha is now 1.0
- add robot_state_publisher dependency for generated pkgs
- disable mongodb creation by default in demo.launch
- add dependency on joint_state_publisher for generated config pkgs
- white space fixes (tabs are now spaces)
- fix #49
- fix #44
- detect when xacro needs to be run and generate planning_context.launch accordingly
- fix #46
- refactor how planners are added to ompl_planning.yaml; include PRM & PRMstar, remove LazyRRT
- change defaults per #47
- SRDFWriter: add initModel() method for initializing from an existing urdf/srdf model in memory.
- SRDFWriter: add INCLUDE_DIRS to catkin_package command so srdf_writer.h can be used by other packages.
- git add option for minimum fraction of 'sometimes in collision'
- fix #41