|
Package Summary
Tags | No category tags. |
Version | 0.9.18 |
License | BSD |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Checkout URI | https://github.com/ros-planning/moveit.git |
VCS Type | git |
VCS Version | kinetic-devel |
Last Updated | 2020-10-12 |
Dev Status | MAINTAINED |
CI status | Continuous Integration |
Released | RELEASED |
Tags | No category tags. |
Contributing |
Help Wanted (0)
Good First Issues (0) Pull Requests to Review (0) |
Package Description
Additional Links
Maintainers
- Michael Ferguson
- Chittaranjan Srinivas Swaminathan
- MoveIt! Release Team
Authors
- Ioan Sucan
- Sachin Chitta
- Acorn Pooley
- Jorge Nicho
Experimental Packages for MoveIt!
This repository includes possibly broken/unmaintained/unfinished libraries that are being worked on or have been worked on in the past. They are not part of MoveIt! officially.
No support is offered for code in this repository, but you are welcome to use it if you see fit.
Changelog for package moveit_experimental
0.9.18 (2020-01-24)
0.9.17 (2019-07-09)
0.9.16 (2019-06-29)
- [maintanance] Cleanup Chomp packages (#1282)
- [maintanance] Disable (unused) dependencies (#1256)
- [maintanance] Resolve catkin lint issues (#1137)
- [maintanance] Improve clang-format (#1214)
- Contributors: Ludovic Delval, Michael Görner, Robert Haschke
0.9.15 (2018-10-29)
- [improvement] Exploit the fact that our transforms are isometries (instead of general affine transformations). #1091
- Contributors: Robert Haschke
0.9.14 (2018-10-24)
0.9.13 (2018-10-24)
- [maintenance] various compiler warnings (#1038)
- [maintenance] add minimum required pluginlib version (#927)
- Contributors: Mikael Arguedas, Robert Haschke, mike lautman
0.9.12 (2018-05-29)
- boost::shared_ptr -> std::shared_ptr
- switch to ROS_LOGGER from CONSOLE_BRIDGE (#874)
- Contributors: Bence Magyar, Ian McMahon, Levi Armstrong, Mikael Arguedas, Robert Haschke, Xiaojian Ma
0.9.11 (2017-12-25)
0.9.10 (2017-12-09)
- [fix] remove explicit fcl depends #632
- Contributors: v4hn
0.9.9 (2017-08-06)
0.9.8 (2017-06-21)
0.9.7 (2017-06-05)
0.9.6 (2017-04-12)
0.9.5 (2017-03-08)
- [fix][moveit_ros_warehouse] gcc6 build error #423
- Contributors: Dave Coleman
0.9.4 (2017-02-06)
- [maintenance] clang-format upgraded to 3.8 (#367)
- Contributors: Dave Coleman
0.9.3 (2016-11-16)
- [maintenance] Updated package.xml maintainers and author emails #330
- Contributors: Dave Coleman, Ian McMahon
0.9.2 (2016-11-05)
0.9.0 (2016-10-19)
- Replace broken Eigen3 with correctly spelled EIGEN3
(#254)
- Fix Eigen3 dependency throughout packages
- Eigen 3.2 does not provide EIGEN3_INCLUDE_DIRS, only EIGEN3_INCLUDE_DIR
- fix exported plugin xml for collision_distance_field (#280) Otherwise the xml can not be found on an installed workspace
- Cleanup readme (#258)
- Convert collision_distance_field to std::shared_ptr.
- Use shared_ptr typedefs in collision_distance_field and chomp.
- Use srdf::ModelPtr typedefs.
- Switch to std::make_shared.
- [moveit_experimental] Fix incorrect dependency on FCL in kinetic [moveit_experimental] Fix Eigen3 warning
- Remove deprecated package shape_tools Fix OcTree boost::shared_ptr Remove deprecated CMake dependency Fix distanceRobot() API with verbose flags
- Fix CHOMP planner and CollisionDistanceField
(#155)
- Copy collision_distance_field package
- Resurrect chomp
- remove some old Makefiles and manifests
- Correct various errors
- Code formatting, author, description, version, etc
- Add definitions for c++11. Nested templates problem.
- Add name to planner plugin.
- Change getJointModels to getActiveJointModels.
- Call robot_state::RobotState::update in setRobotStateFromPoint.
- Create README.md
- Improve package.xml, CMake config and other changes suggested by jrgnicho.
- Remove some commented code, add scaling factors to computeTimeStampes
- Add install targets in moveit_experimental and chomp
- Add install target for headers in chomp pkgs.
- Remove unnecessary debugging ROS_INFO.
- Port collision_distance_field test to indigo.
- Remove one assertion that makes collision_distance_field test to fail.
- Use
urdf::*SharedPtr
instead ofboost::shared_ptr
- fetch moveit_resources path at compile time using variable MOVEIT_TEST_RESOURCES_DIR provided by config.h instead of calling ros::package::getPath()
- adapted paths to moveit_resources (renamed folder moveit_resources/test to moveit_resources/pr2_description)
- Contributors: Chittaranjan Srinivas Swaminathan, Dave Coleman, Jochen Sprickerhof, Maarten de Vries, Michael Görner, Robert Haschke
0.8.3 (2016-08-21)
- this was implemented in a different way
- add kinematics constraint aware
- add kinematics_cache
- Update README.md
- Update README.md
- Create README.md
- copy collision_distance_field from moveit_core
- rename some headers
- add collision_distance_field_ros
- add kinematics_planner_ros
- added kinematics_cache_ros from moveit-ros
- moved from moveit_core
- Contributors: Ioan Sucan, isucan
Wiki Tutorials
Dependant Packages
Launch files
Messages
Services
Plugins
Recent questions tagged moveit_experimental at Robotics Stack Exchange
|
Package Summary
Tags | No category tags. |
Version | 0.8.7 |
License | BSD |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Checkout URI | https://github.com/ros-planning/moveit.git |
VCS Type | git |
VCS Version | jade-devel |
Last Updated | 2017-07-23 |
Dev Status | MAINTAINED |
CI status | Continuous Integration |
Released | RELEASED |
Tags | No category tags. |
Contributing |
Help Wanted (0)
Good First Issues (0) Pull Requests to Review (0) |
Package Description
Additional Links
Maintainers
- Sachin Chitta
- Michael Ferguson
- Chittaranjan Srinivas Swaminathan
Authors
- Ioan Sucan
- Sachin Chitta
- Acorn Pooley
- Jorge Nicho
Experimental Packages for MoveIt!
This repository includes possibly broken/unmaintained/unfinished libraries that are being worked on or have been worked on in the past. They are not part of MoveIt! officially.
No support is offered for code in this repository, but you are welcome to use it if you see fit.
Changelog for package moveit_experimental
0.8.7 (2017-04-03)
0.8.6 (2017-03-08)
0.8.4 (2017-02-06)
0.8.3 (2016-08-19)
- Dummy to temporarily workaround https://github.com/ros-infrastructure/catkin_pkg/issues/158#issuecomment-277852080
Wiki Tutorials
Package Dependencies
System Dependencies
Dependant Packages
Name | Deps |
---|---|
moveit_planners_chomp | |
chomp_motion_planner |
Launch files
Messages
Services
Plugins
Recent questions tagged moveit_experimental at Robotics Stack Exchange
|
Package Summary
Tags | No category tags. |
Version | 0.7.14 |
License | BSD |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Checkout URI | https://github.com/ros-planning/moveit.git |
VCS Type | git |
VCS Version | indigo-devel |
Last Updated | 2019-06-17 |
Dev Status | MAINTAINED |
CI status | Continuous Integration |
Released | RELEASED |
Tags | No category tags. |
Contributing |
Help Wanted (0)
Good First Issues (0) Pull Requests to Review (0) |
Package Description
Additional Links
Maintainers
- Michael Ferguson
- Chittaranjan Srinivas Swaminathan
- MoveIt! Release Team
Authors
- Ioan Sucan
- Sachin Chitta
- Acorn Pooley
- Jorge Nicho
Experimental Packages for MoveIt!
This repository includes possibly broken/unmaintained/unfinished libraries that are being worked on or have been worked on in the past. They are not part of MoveIt! officially.
No support is offered for code in this repository, but you are welcome to use it if you see fit.
Changelog for package moveit_experimental
0.7.14 (2018-10-20)
0.7.13 (2017-12-25)
- [fix] remove explicit fcl depends #632
- Contributors: v4hn
0.7.12 (2017-08-06)
0.7.11 (2017-06-21)
0.7.10 (2017-06-07)
0.7.9 (2017-04-03)
0.7.8 (2017-03-08)
- [fix][moveit_ros_warehouse] gcc6 build error #423
- Contributors: Dmitry Rozhkov
0.7.7 (2017-02-06)
- clang-format upgraded to 3.8 (#404)
- Contributors: Dave Coleman
0.7.6 (2016-12-30)
0.7.5 (2016-12-25)
0.7.4 (2016-12-22)
- [indigo][changelog] Remove wrong version entries (see https://github.com/ros-planning/moveit/issues/386#issuecomment-268689110).
- Contributors: Isaac I.Y. Saito
0.7.3 (2016-12-20)
- [ROS Indigo] Initial release from ros-planning/moveit repository.
- [fix] exported plugin xml for collision_distance_field (#280)
- [fix] CHOMP planner and CollisionDistanceField (#155)
- [maintenance] add full VERSIONs / SONAMEs to all libraries (#273)
- [maintenance] Auto code formatted Indigo branch using clang-format (#313)
- Contributors: Chittaranjan Srinivas Swaminathan, Dave Coleman, Michael Goerner, Robert Haschke
Wiki Tutorials
Package Dependencies
System Dependencies
Dependant Packages
Name | Deps |
---|---|
moveit_planners_chomp | |
chomp_motion_planner |
Launch files
Messages
Services
Plugins
Recent questions tagged moveit_experimental at Robotics Stack Exchange
|
Package Summary
Tags | No category tags. |
Version | 0.9.18 |
License | BSD |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Checkout URI | https://github.com/ros-planning/moveit.git |
VCS Type | git |
VCS Version | kinetic-devel |
Last Updated | 2020-10-12 |
Dev Status | MAINTAINED |
CI status | Continuous Integration |
Released | RELEASED |
Tags | No category tags. |
Contributing |
Help Wanted (0)
Good First Issues (0) Pull Requests to Review (0) |
Package Description
Additional Links
Maintainers
- Michael Ferguson
- Chittaranjan Srinivas Swaminathan
- MoveIt! Release Team
Authors
- Ioan Sucan
- Sachin Chitta
- Acorn Pooley
- Jorge Nicho
Experimental Packages for MoveIt!
This repository includes possibly broken/unmaintained/unfinished libraries that are being worked on or have been worked on in the past. They are not part of MoveIt! officially.
No support is offered for code in this repository, but you are welcome to use it if you see fit.
Changelog for package moveit_experimental
0.9.18 (2020-01-24)
0.9.17 (2019-07-09)
0.9.16 (2019-06-29)
- [maintanance] Cleanup Chomp packages (#1282)
- [maintanance] Disable (unused) dependencies (#1256)
- [maintanance] Resolve catkin lint issues (#1137)
- [maintanance] Improve clang-format (#1214)
- Contributors: Ludovic Delval, Michael Görner, Robert Haschke
0.9.15 (2018-10-29)
- [improvement] Exploit the fact that our transforms are isometries (instead of general affine transformations). #1091
- Contributors: Robert Haschke
0.9.14 (2018-10-24)
0.9.13 (2018-10-24)
- [maintenance] various compiler warnings (#1038)
- [maintenance] add minimum required pluginlib version (#927)
- Contributors: Mikael Arguedas, Robert Haschke, mike lautman
0.9.12 (2018-05-29)
- boost::shared_ptr -> std::shared_ptr
- switch to ROS_LOGGER from CONSOLE_BRIDGE (#874)
- Contributors: Bence Magyar, Ian McMahon, Levi Armstrong, Mikael Arguedas, Robert Haschke, Xiaojian Ma
0.9.11 (2017-12-25)
0.9.10 (2017-12-09)
- [fix] remove explicit fcl depends #632
- Contributors: v4hn
0.9.9 (2017-08-06)
0.9.8 (2017-06-21)
0.9.7 (2017-06-05)
0.9.6 (2017-04-12)
0.9.5 (2017-03-08)
- [fix][moveit_ros_warehouse] gcc6 build error #423
- Contributors: Dave Coleman
0.9.4 (2017-02-06)
- [maintenance] clang-format upgraded to 3.8 (#367)
- Contributors: Dave Coleman
0.9.3 (2016-11-16)
- [maintenance] Updated package.xml maintainers and author emails #330
- Contributors: Dave Coleman, Ian McMahon
0.9.2 (2016-11-05)
0.9.0 (2016-10-19)
- Replace broken Eigen3 with correctly spelled EIGEN3
(#254)
- Fix Eigen3 dependency throughout packages
- Eigen 3.2 does not provide EIGEN3_INCLUDE_DIRS, only EIGEN3_INCLUDE_DIR
- fix exported plugin xml for collision_distance_field (#280) Otherwise the xml can not be found on an installed workspace
- Cleanup readme (#258)
- Convert collision_distance_field to std::shared_ptr.
- Use shared_ptr typedefs in collision_distance_field and chomp.
- Use srdf::ModelPtr typedefs.
- Switch to std::make_shared.
- [moveit_experimental] Fix incorrect dependency on FCL in kinetic [moveit_experimental] Fix Eigen3 warning
- Remove deprecated package shape_tools Fix OcTree boost::shared_ptr Remove deprecated CMake dependency Fix distanceRobot() API with verbose flags
- Fix CHOMP planner and CollisionDistanceField
(#155)
- Copy collision_distance_field package
- Resurrect chomp
- remove some old Makefiles and manifests
- Correct various errors
- Code formatting, author, description, version, etc
- Add definitions for c++11. Nested templates problem.
- Add name to planner plugin.
- Change getJointModels to getActiveJointModels.
- Call robot_state::RobotState::update in setRobotStateFromPoint.
- Create README.md
- Improve package.xml, CMake config and other changes suggested by jrgnicho.
- Remove some commented code, add scaling factors to computeTimeStampes
- Add install targets in moveit_experimental and chomp
- Add install target for headers in chomp pkgs.
- Remove unnecessary debugging ROS_INFO.
- Port collision_distance_field test to indigo.
- Remove one assertion that makes collision_distance_field test to fail.
- Use
urdf::*SharedPtr
instead ofboost::shared_ptr
- fetch moveit_resources path at compile time using variable MOVEIT_TEST_RESOURCES_DIR provided by config.h instead of calling ros::package::getPath()
- adapted paths to moveit_resources (renamed folder moveit_resources/test to moveit_resources/pr2_description)
- Contributors: Chittaranjan Srinivas Swaminathan, Dave Coleman, Jochen Sprickerhof, Maarten de Vries, Michael Görner, Robert Haschke
0.8.3 (2016-08-21)
- this was implemented in a different way
- add kinematics constraint aware
- add kinematics_cache
- Update README.md
- Update README.md
- Create README.md
- copy collision_distance_field from moveit_core
- rename some headers
- add collision_distance_field_ros
- add kinematics_planner_ros
- added kinematics_cache_ros from moveit-ros
- moved from moveit_core
- Contributors: Ioan Sucan, isucan
Wiki Tutorials
Dependant Packages
Name | Deps |
---|---|
doosan_robotics |