|
Package Summary
Tags | No category tags. |
Version | 2.8.0 |
License | BSD-3-Clause |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Checkout URI | https://github.com/ros-planning/moveit2.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2023-11-27 |
Dev Status | DEVELOPED |
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
Additional Links
Maintainers
- Henning Kayser
- Tyler Weaver
- Jon Binney
- MoveIt Release Team
Authors
- Ioan Sucan
- Dave Coleman
- Sachin Chitta
Changelog for package moveit_ros_visualization
2.8.0 (2023-09-10)
- Remove boost from motion_planning_rviz_plugin (#2308) Co-authored-by: Sebastian Jahr <sebastian.jahr@tuta.io>
- Replaced numbers with SystemDefaultsQos() (#2271)
- fix for not having transparency in collision scenes on rviz. (#2242) Co-authored-by: Alp Akgun <samialp.akgun@ocado.com>
- Contributors: Sami Alperen Akg
Wiki Tutorials
Source Tutorials
Package Dependencies
System Dependencies
Dependant Packages
Launch files
Messages
Services
Recent questions tagged moveit_ros_visualization at answers.ros.org
|
Package Summary
Tags | No category tags. |
Version | 2.8.0 |
License | BSD-3-Clause |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Checkout URI | https://github.com/ros-planning/moveit2.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2023-11-27 |
Dev Status | DEVELOPED |
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
Additional Links
Maintainers
- Henning Kayser
- Tyler Weaver
- Jon Binney
- MoveIt Release Team
Authors
- Ioan Sucan
- Dave Coleman
- Sachin Chitta
Changelog for package moveit_ros_visualization
2.8.0 (2023-09-10)
- Remove boost from motion_planning_rviz_plugin (#2308) Co-authored-by: Sebastian Jahr <sebastian.jahr@tuta.io>
- Replaced numbers with SystemDefaultsQos() (#2271)
- fix for not having transparency in collision scenes on rviz. (#2242) Co-authored-by: Alp Akgun <samialp.akgun@ocado.com>
- Contributors: Sami Alperen Akg
Wiki Tutorials
Source Tutorials
Package Dependencies
System Dependencies
Dependant Packages
Launch files
Messages
Services
Recent questions tagged moveit_ros_visualization at answers.ros.org
|
Package Summary
Tags | No category tags. |
Version | 2.8.0 |
License | BSD-3-Clause |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Checkout URI | https://github.com/ros-planning/moveit2.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2023-11-27 |
Dev Status | DEVELOPED |
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
Additional Links
Maintainers
- Henning Kayser
- Tyler Weaver
- Jon Binney
- MoveIt Release Team
Authors
- Ioan Sucan
- Dave Coleman
- Sachin Chitta
Changelog for package moveit_ros_visualization
2.8.0 (2023-09-10)
- Remove boost from motion_planning_rviz_plugin (#2308) Co-authored-by: Sebastian Jahr <sebastian.jahr@tuta.io>
- Replaced numbers with SystemDefaultsQos() (#2271)
- fix for not having transparency in collision scenes on rviz. (#2242) Co-authored-by: Alp Akgun <samialp.akgun@ocado.com>
- Contributors: Sami Alperen Akg
Wiki Tutorials
Source Tutorials
Package Dependencies
System Dependencies
Dependant Packages
Launch files
Messages
Services
Recent questions tagged moveit_ros_visualization at answers.ros.org
|
Package Summary
Tags | No category tags. |
Version | 1.1.13 |
License | BSD |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Checkout URI | https://github.com/ros-planning/moveit.git |
VCS Type | git |
VCS Version | master |
Last Updated | 2023-11-21 |
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
Additional Links
Maintainers
- Jon Binney
- Michael Ferguson
- MoveIt Release Team
Authors
- Ioan Sucan
- Dave Coleman
- Sachin Chitta
Changelog for package moveit_ros_visualization
1.1.13 (2023-07-28)
- Avoid costly updates of invisible RobotInteractions on query state changes (#3478)
- Contributors: Robert Haschke
1.1.12 (2023-05-13)
- MPD: Resolve namespace ambiguity in RobotInteraction (#3403)
- Disallow custom string for planning group property in RViz Display (#3346)
- Fixes to octomap display in PSD (#3385)
- MPD: maintain current item when updating object list
- TrajectoryDisplay: sync visibility of links in trail with main robot (#3337)
- Contributors: Robert Haschke, Simon Schmeisser, Tejal Ashwini Barnwal
1.1.11 (2022-12-21)
- Fix some consistency issues in PlanningScene handling
(#3298)
- Allow Plane collision-object creation from rviz
- Simplify Cone rendering
- Visualize PLANE shapes as a large, thin box
-
Merge fixes+improvements to
PlanningScene
editing in rviz: #3263, #3264, #3296- Fix error \"QBackingStore::endPaint() called with active painter\"
- Remove limitation to one-shape collision objects
- Fix segfault on object scaling: only update a _valid scene marker
- JointsWidget: Copy full RobotState on updates (attached collision objects were missing)
- Factor out
addCollisionObjectToList()
frompopulateCollisionObjectsList()
- Simplify
MotionPlanningFrame::addSceneObject
-
Directly call
populateCollisionObjectsList()
if possibleCalling was previously deferred into a main loop job, because most callers already held a PlanningScene lock, thus causing recursive locking and a deadlock. By simply passing the locked scene, these issues can be avoided. As a fallback, the PlanningScene lock is still acquired in the function.
updateQueryStates()
after removal of attached objectsClear scene objects: only clear locally. To publish changes, one should explicitly click the \"Publish\" button.
Scene Object List: allow extended selection mode
always update query states - even if they are disabled for visualization
only allow execution if start state is up-to-date
-
Merge PR #3227: Improve MotionPlanning plugin\'s JointsWidget
- Add units to sliders in JointsWidget and to spinbox editor
- Avoid need for extra click to operate joint slider
- allow control of joints via keyboard
Contributors: Robert Haschke
1.1.10 (2022-09-13)
Wiki Tutorials
Source Tutorials
Package Dependencies
System Dependencies
Dependant Packages
Launch files
Messages
Services
Recent questions tagged moveit_ros_visualization at answers.ros.org
|
Package Summary
Tags | No category tags. |
Version | 2.0.0 |
License | BSD |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Checkout URI | https://github.com/ros-planning/moveit2.git |
VCS Type | git |
VCS Version | eloquent |
Last Updated | 2020-10-13 |
Dev Status | DEVELOPED |
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
Additional Links
Maintainers
- Jon Binney
- Michael Ferguson
- MoveIt Release Team
Authors
- Ioan Sucan
- Dave Coleman
- Sachin Chitta
Changelog for package moveit_ros_visualization
2.0.0 (2020-02-17)
- [fix] moveit_ros_visualization fixes
(#168)
- robot_state_display: Fix empty robot description field
- planning scene plugin: Fix destroySceneNode
- [fix] Fix moveit_ros_visualization (#167)
- [port] Port moveit ros visualization to ROS 2 (#160)
- [port] Port rdf_loader to ROS2 (#104)
- Contributors: Henning Kayser, Jafar Abdi
1.0.1 (2019-03-08)
- [improve] Apply clang tidy fix to entire code base (Part 1) (#1366)
- Contributors: Isaac Robert Haschke, Yu, Yan
1.0.0 (2019-02-24)
- [fix] catkin_lint issues (#1341)
- Contributors: Dave Coleman, Robert Haschke
0.10.8 (2018-12-24)
- [fix] Handle exceptions in rviz plugins (#1267)
- Contributors: Christian Rauch, Robert Haschke
0.10.7 (2018-12-13)
0.10.6 (2018-12-09)
- [enhancement] Add check box for CartesianPath planning (#1238)
- [enhancement] Improve MotionPlanning panel
(#1198)
- Allow selection of planning group in planning panel
- Choose start and goal state directly from combobox
- [fix] rviz crash when changing the planning group while executing (#1198)
- [fix] Fix several issues in rendering of attached bodies
(#1199)
- Show / hide attached body together with robot
- Force PlanningScene rendering on enable
- Link SceneDisplay\'s attached-body-color to TrajectoryVisualization\'s one
- [maintenance] Replaced Eigen::Affine3d -> Eigen::Isometry3d (#1096)
- [maintenance] Use C++14 (#1146)
- [maintenance] Cleanup Robot Interaction
(#1194)
- Postpone subscription to trajectory topic
- Fix memory leaks
- [maintenance] Simplify shared tf2 buffer usage (#1196)
- [maintenance] Code Cleanup (#1179)
- Remove obsolete eigen_conversions dependency (#1181)
- Contributors: Alex Moriarty, Benjamin Scholz, Dave Coleman, Kei Okada, Michael G
Wiki Tutorials
Source Tutorials
Package Dependencies
Deps | Name | |
---|---|---|
1 | class_loader | |
1 | ament_cmake | |
1 | geometric_shapes | |
1 | interactive_markers | |
3 | moveit_ros_planning_interface | |
1 | object_recognition_msgs | |
1 | pluginlib | |
1 | rclcpp | |
1 | rclpy | |
1 | rviz2 | |
3 | tf2_eigen |
System Dependencies
Dependant Packages
Launch files
Messages
Services
Recent questions tagged moveit_ros_visualization at answers.ros.org
|
Package Summary
Tags | No category tags. |
Version | 2.8.0 |
License | BSD-3-Clause |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Checkout URI | https://github.com/ros-planning/moveit2.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2023-11-27 |
Dev Status | DEVELOPED |
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
Additional Links
Maintainers
- Henning Kayser
- Tyler Weaver
- Jon Binney
- MoveIt Release Team
Authors
- Ioan Sucan
- Dave Coleman
- Sachin Chitta
Changelog for package moveit_ros_visualization
2.8.0 (2023-09-10)
- Remove boost from motion_planning_rviz_plugin (#2308) Co-authored-by: Sebastian Jahr <sebastian.jahr@tuta.io>
- Replaced numbers with SystemDefaultsQos() (#2271)
- fix for not having transparency in collision scenes on rviz. (#2242) Co-authored-by: Alp Akgun <samialp.akgun@ocado.com>
- Contributors: Sami Alperen Akg
Wiki Tutorials
Source Tutorials
Package Dependencies
System Dependencies
Dependant Packages
Launch files
Messages
Services
Recent questions tagged moveit_ros_visualization at answers.ros.org
|
Package Summary
Tags | No category tags. |
Version | 2.8.0 |
License | BSD-3-Clause |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Checkout URI | https://github.com/ros-planning/moveit2.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2023-11-27 |
Dev Status | DEVELOPED |
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
Additional Links
Maintainers
- Henning Kayser
- Tyler Weaver
- Jon Binney
- MoveIt Release Team
Authors
- Ioan Sucan
- Dave Coleman
- Sachin Chitta
Changelog for package moveit_ros_visualization
2.8.0 (2023-09-10)
- Remove boost from motion_planning_rviz_plugin (#2308) Co-authored-by: Sebastian Jahr <sebastian.jahr@tuta.io>
- Replaced numbers with SystemDefaultsQos() (#2271)
- fix for not having transparency in collision scenes on rviz. (#2242) Co-authored-by: Alp Akgun <samialp.akgun@ocado.com>
- Contributors: Sami Alperen Akg
Wiki Tutorials
Source Tutorials
Package Dependencies
System Dependencies
Dependant Packages
Launch files
Messages
Services
Recent questions tagged moveit_ros_visualization at answers.ros.org
|
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 | No 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
- Jon Binney
- Michael Ferguson
- MoveIt! Release Team
Authors
- Ioan Sucan
- Dave Coleman
- Sachin Chitta
Changelog for package moveit_ros_visualization
0.9.18 (2020-01-24)
0.9.17 (2019-07-09)
0.9.16 (2019-06-29)
- [maintanance] Resolve catkin lint issues (#1137)
- [maintanance] Improve clang-format (#1214)
- [fix] Fix issues in rendering of attached bodies (#1199)
- Contributors: Ludovic Delval, Robert Haschke, Sven Krause
0.9.15 (2018-10-29)
- [improvement] Exploit the fact that our transforms are isometries (instead of general affine transformations). #1091
- [maintenance] Store more settings of rviz\' PlanningFrame (#1135)
- [code] cleanup, improvements (#1141)
- Contributors: Alexander Gutenkunst, Jonathan Hechtbauer, Robert Haschke
0.9.14 (2018-10-24)
0.9.13 (2018-10-24)
Wiki Tutorials
Source Tutorials
Package Dependencies
System Dependencies
Name |
---|
eigen |
pkg-config |
Dependant Packages
Launch files
Messages
Services
Recent questions tagged moveit_ros_visualization 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 | 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
Additional Links
Maintainers
- Ioan Sucan
- Michael Ferguson
Authors
- Ioan Sucan
- Dave Coleman
- Sachin Chitta
Changelog for package moveit_ros_visualization
0.6.6 (2016-06-08)
- cleanup cmake tests, fix empty output
- added missing rostest dependency (#680), fixes c6d0ede (#639)
- [moveit joy] Add friendlier error message
- relax Qt-version requirement Minor Qt version updates are ABI-compatible with each other: https://wiki.qt.io/Qt-Version-Compatibility
- replaced cmake_modules dependency with eigen
- [jade] eigen3 adjustment
- always (re)create collision object marker other properties than pose (such as name of the marker) need to be adapted too
- use getModelFrame() as reference frame for markers
- moved \"Publish Scene\" button to \"Scene Objects\" tab previous location on \"Context\" tab was weird
- cherry-pick PR #635 from indigo-devel
- unify Qt4 / Qt5 usage across cmake files
- fetch Qt version from rviz
- define variables/macros commonly used for Qt4 and Qt5
- QT_LIBRARIES
- qt_wrap_ui()
- leave frame transforms to rviz The old code (1.) reimplemented frame transforms in rviz although it could simply utilize rviz\' FrameManager (2.) assumed the transform between the model-frame and the fixed_frame was constant and only needed to be updated if the frame changes (ever tried to make the endeffector your fixed frame?) (3.) was broken because on startup calculateOffsetPosition was called before the robot model is loaded, so the first (and usually only) call to calculateOffsetPosition failed. Disabling/Enabling the display could be used to work around this... This fixes all three issues.
- display planned path in correct rviz context This was likely a typo.
- Solved parse error with Boost 1.58. Fixes #653
- Enable optional build against Qt5, use -DUseQt5=On to enable it
- explicitly link rviz\' default_plugin library The library is not exported anymore and now is provided separately from rviz_LIBRARIES. See https://github.com/ros-visualization/rviz/pull/979 for details.
- merge indigo-devel changes (PR #633 trailing whitespace) into jade-devel
- Removed trailing whitespace from entire repository
- correctly handle int and float parameters Try to parse parameter as int and float (in that series) and use IntProperty or FloatProperty on success to have input checking. Floats formatted without decimal dot, e.g. \"0\", will be considered as int! All other parameters will be handled as string.
- access planner params in rviz\' MotionPlanningFrame
- new method MoveGroup::getDefaultPlannerId(const std::string &group) ... to retrieve default planner config from param server moved corresponding code from rviz plugin to MoveGroup interface to facilitate re-use
- correctly initialize scene robot\'s parameters after initialization
- loaded parameters were ignored
- changed default alpha value to 1 to maintain previous behaviour
- load default_planner_config from default location instead of loading from [/<ns>/default_planner_config]{.title-ref}, use [/<ns>/move_group/<group>/default_planner_config]{.title-ref}, which is the default location for [planner_configs]{.title-ref} too
- Merge pull request #610: correctly update all markers after robot motion
- fixing conflicts, renaming variable
- Merge pull request #612 from ubi-agni/interrupt-traj-vis interrupt trajectory visualization on arrival of new display trajectory
- cherry-picked PR #611 fix segfault when disabling and re-enabling TrajectoryVisualization
- cherry-picked PR #609 load / save rviz\' workspace config fixed tab order of rviz plugin widgets use move_group/default_workspace_bounds as a fallback for workspace bounds
- fixup! cleanup TrajectoryVisualization::update only enter visualization loop when displaying_trajectory_message is defined
- added missing initialization
- correctly setAlpha for new trail
-
fixed race condition for trajectory-display interruption - TrajectoryVisualization::update() switches to new trajectory automatically when it has finished displaying the old one - TrajectoryVisualization::interruptCurrentDisplay() might interrupt this newly started trajectory consequences:
- protect switching of trajectory with mutex
- interrupt only if trajectory display progressed past first waypoint
- removed obsolete signal timeToShowNewTrail: update() automatically switches and updates trail in sync
cleanup TrajectoryVisualization::update simplified code to switch to new trajectory / start over animation in loop mode
new GUI property to allow immediate interruption of displayed trajectory
immediately show trajectory after planning (interrupting current display)
fix segfault when disabling and re-enabling TrajectoryVisualization animating_path was still true causing update() to access displaying_trajectory_message, which was reset onDisable().
update pose of all markers when any marker moved Having several end-effector markers attached to a group (e.g. a multi-fingered hand having an end-effector per fingertip and an end-effector for the hand base), all markers need to update their pose on any motion of any marker. In the example: if the hand base is moved, the fingertip markers should be moved too.
use move_group/default_workspace_bounds as a fallback for workspace bounds
code style cleanup
fixed tab order of rviz plugin widgets
load / save rviz\' workspace config
saves robot name to db from moveit. also robot name accessible through robot interface python wrapper
Added install rule to install moveit_joy.py.
motion_planning_frame_planning: use /default_planner_config parma to specify default planning algorithm
Avoid adding a slash if getMoveGroupNS() is empty. If the getMoveGroupNS() returns an empty string, ros::names::append() inserts a slash in front of \'right\', which changes it to a global name. Checking getMoveGroupNS() before calling append removes the issue. append() behaviour will not be changed in ros/ros_comm.
Contributors: Ammar Najjar, Dave Coleman, Isaac I.Y. Saito, Jochen Welle, Kei Okada, Michael Ferguson, Michael G
Wiki Tutorials
Source Tutorials
Package Dependencies
System Dependencies
Name |
---|
eigen |
pkg-config |
Dependant Packages
Launch files
Messages
Services
Recent questions tagged moveit_ros_visualization 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
Additional Links
Maintainers
- Ioan Sucan
- Michael Ferguson
Authors
- Ioan Sucan
- Dave Coleman
- Sachin Chitta
Could not convert RST to MD: pandoc: Cannot decode byte '\x8f': Data.Text.Internal.Encoding.decodeUtf8: Invalid UTF-8 stream
Wiki Tutorials
Source Tutorials
Package Dependencies
System Dependencies
Name |
---|
pkg-config |
Dependant Packages
Launch files
Messages
Services
Recent questions tagged moveit_ros_visualization 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
Additional Links
Maintainers
- Ioan Sucan
Authors
- Ioan Sucan
- Dave Coleman
- Sachin Chitta
Changelog for package moveit_ros_visualization
0.5.20 (2014-12-09)
- Removed installation of removed file
- Better user output, kinematic solver error handling, disclaimer
- Add joystick interface.
- motion_planning_rviz_plugin: add move_group namespace option
- Added capability to set max_planning_attempts in GUI.
- Contributors: Chris Lewis, Dave Coleman, Ioan A Sucan, Jonathan Bohren, Ryohei Ueda, Sachin Chitta
0.5.19 (2014-06-23)
- Changed rviz plugin action server wait to non-simulated time
- Fix [-Wreorder] warning.
- Fix RobotState rviz plugin to not display when disabled
- Add check for planning scene monitor connection, with 5 sec delay
- Contributors: Adolfo Rodriguez Tsouroukdissian, Dave Coleman
0.5.18 (2014-03-23)
- add pkg-config as dep
- find PkgConfig before using pkg_check_modules PC specific functions mustn\'t be used before including PkgConfig
- Contributors: Ioan Sucan, v4hn
0.5.17 (2014-03-22)
- update build system for ROS indigo
- update maintainer e-mail
- Contributors: Ioan Sucan
0.5.16 (2014-02-27)
- back out problematic ogre fixes
- robot_interaction: split InteractionHandler into its own file
- Switched from isStateColliding to isStateValid
- Changed per PR review
- Clean up debug output
- Added ability to set a random <collision free> start/goal position
- Merge branch \'hydro-devel\' of https://github.com/ros-planning/moveit_ros into acorn_rviz_stereo
- rviz: prepare for Ogre1.10
- Contributors: Acorn Pooley, Dave Coleman
0.5.14 (2014-02-06)
0.5.13 (2014-02-06)
- remove debug printfs
- planning_scene_display: use requestPlanningSceneState() Get current planning scene state when planning scene display is enabled and/or model is loaded.
- Fix Parse error at \"BOOST_JOIN\" error See: https://bugreports.qt-project.org/browse/QTBUG-22829
- Contributors: Acorn Pooley, Benjamin Chretien
0.5.12 (2014-01-03)
0.5.11 (2014-01-03)
- Added back-link to tutorial and updated moveit website URL.
- Ported MoveIt RViz plugin tutorial to sphinx.
- Contributors: Dave Hershberger
0.5.10 (2013-12-08)
0.5.9 (2013-12-03)
- correcting maintainer email
- Fixed an occasional crash bug in rviz plugin caused by gui calls in non-gui thread.
- Added planning feedback to gui, refactored states tab
- Stored states are auto loaded when warehouse database is connected
0.5.8 (2013-10-11)
- Added option to rviz plugin to show scene robot collision geometry
0.5.7 (2013-10-01)
0.5.6 (2013-09-26)
0.5.5 (2013-09-23)
- Fix crash when the destructor is called before onInitialize
- remove call for getting the combined joint limits of a group
- bugfixes
- porting to new RobotState API
- use new helper class from rviz for rendering meshes
0.5.4 (2013-08-14)
- Added manipulation tab, added plan id to manipulation request
- make headers and author definitions aligned the same way; white space fixes
- using action client for object recognition instead of topic
- move background_processing lib to core
- display collision pairs instead of simply colliding links
0.5.2 (2013-07-15)
0.5.1 (2013-07-14)
0.5.0 (2013-07-12)
- fix #275
- white space fixes (tabs are now spaces)
0.4.5 (2013-07-03)
0.4.4 (2013-06-26)
- remove root_link_name property
- add status tab to Rviz plugin
Wiki Tutorials
Source Tutorials
Package Dependencies
System Dependencies
Name |
---|
pkg-config |
Dependant Packages
Launch files
Messages
Services
Recent questions tagged moveit_ros_visualization 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
Additional Links
Maintainers
- Ioan Sucan
- Michael Ferguson
Authors
- Ioan Sucan
- Dave Coleman
- Sachin Chitta
Changelog for package moveit_ros_visualization
0.6.6 (2016-06-08)
- cleanup cmake tests, fix empty output
- added missing rostest dependency (#680), fixes c6d0ede (#639)
- [moveit joy] Add friendlier error message
- relax Qt-version requirement Minor Qt version updates are ABI-compatible with each other: https://wiki.qt.io/Qt-Version-Compatibility
- replaced cmake_modules dependency with eigen
- [jade] eigen3 adjustment
- always (re)create collision object marker other properties than pose (such as name of the marker) need to be adapted too
- use getModelFrame() as reference frame for markers
- moved \"Publish Scene\" button to \"Scene Objects\" tab previous location on \"Context\" tab was weird
- cherry-pick PR #635 from indigo-devel
- unify Qt4 / Qt5 usage across cmake files
- fetch Qt version from rviz
- define variables/macros commonly used for Qt4 and Qt5
- QT_LIBRARIES
- qt_wrap_ui()
- leave frame transforms to rviz The old code (1.) reimplemented frame transforms in rviz although it could simply utilize rviz\' FrameManager (2.) assumed the transform between the model-frame and the fixed_frame was constant and only needed to be updated if the frame changes (ever tried to make the endeffector your fixed frame?) (3.) was broken because on startup calculateOffsetPosition was called before the robot model is loaded, so the first (and usually only) call to calculateOffsetPosition failed. Disabling/Enabling the display could be used to work around this... This fixes all three issues.
- display planned path in correct rviz context This was likely a typo.
- Solved parse error with Boost 1.58. Fixes #653
- Enable optional build against Qt5, use -DUseQt5=On to enable it
- explicitly link rviz\' default_plugin library The library is not exported anymore and now is provided separately from rviz_LIBRARIES. See https://github.com/ros-visualization/rviz/pull/979 for details.
- merge indigo-devel changes (PR #633 trailing whitespace) into jade-devel
- Removed trailing whitespace from entire repository
- correctly handle int and float parameters Try to parse parameter as int and float (in that series) and use IntProperty or FloatProperty on success to have input checking. Floats formatted without decimal dot, e.g. \"0\", will be considered as int! All other parameters will be handled as string.
- access planner params in rviz\' MotionPlanningFrame
- new method MoveGroup::getDefaultPlannerId(const std::string &group) ... to retrieve default planner config from param server moved corresponding code from rviz plugin to MoveGroup interface to facilitate re-use
- correctly initialize scene robot\'s parameters after initialization
- loaded parameters were ignored
- changed default alpha value to 1 to maintain previous behaviour
- load default_planner_config from default location instead of loading from [/<ns>/default_planner_config]{.title-ref}, use [/<ns>/move_group/<group>/default_planner_config]{.title-ref}, which is the default location for [planner_configs]{.title-ref} too
- Merge pull request #610: correctly update all markers after robot motion
- fixing conflicts, renaming variable
- Merge pull request #612 from ubi-agni/interrupt-traj-vis interrupt trajectory visualization on arrival of new display trajectory
- cherry-picked PR #611 fix segfault when disabling and re-enabling TrajectoryVisualization
- cherry-picked PR #609 load / save rviz\' workspace config fixed tab order of rviz plugin widgets use move_group/default_workspace_bounds as a fallback for workspace bounds
- fixup! cleanup TrajectoryVisualization::update only enter visualization loop when displaying_trajectory_message is defined
- added missing initialization
- correctly setAlpha for new trail
-
fixed race condition for trajectory-display interruption - TrajectoryVisualization::update() switches to new trajectory automatically when it has finished displaying the old one - TrajectoryVisualization::interruptCurrentDisplay() might interrupt this newly started trajectory consequences:
- protect switching of trajectory with mutex
- interrupt only if trajectory display progressed past first waypoint
- removed obsolete signal timeToShowNewTrail: update() automatically switches and updates trail in sync
cleanup TrajectoryVisualization::update simplified code to switch to new trajectory / start over animation in loop mode
new GUI property to allow immediate interruption of displayed trajectory
immediately show trajectory after planning (interrupting current display)
fix segfault when disabling and re-enabling TrajectoryVisualization animating_path was still true causing update() to access displaying_trajectory_message, which was reset onDisable().
update pose of all markers when any marker moved Having several end-effector markers attached to a group (e.g. a multi-fingered hand having an end-effector per fingertip and an end-effector for the hand base), all markers need to update their pose on any motion of any marker. In the example: if the hand base is moved, the fingertip markers should be moved too.
use move_group/default_workspace_bounds as a fallback for workspace bounds
code style cleanup
fixed tab order of rviz plugin widgets
load / save rviz\' workspace config
saves robot name to db from moveit. also robot name accessible through robot interface python wrapper
Added install rule to install moveit_joy.py.
motion_planning_frame_planning: use /default_planner_config parma to specify default planning algorithm
Avoid adding a slash if getMoveGroupNS() is empty. If the getMoveGroupNS() returns an empty string, ros::names::append() inserts a slash in front of \'right\', which changes it to a global name. Checking getMoveGroupNS() before calling append removes the issue. append() behaviour will not be changed in ros/ros_comm.
Contributors: Ammar Najjar, Dave Coleman, Isaac I.Y. Saito, Jochen Welle, Kei Okada, Michael Ferguson, Michael G
Wiki Tutorials
Source Tutorials
Package Dependencies
System Dependencies
Name |
---|
eigen |
pkg-config |
Dependant Packages
Launch files
Messages
Services
Recent questions tagged moveit_ros_visualization at answers.ros.org
|
Package Summary
Tags | No category tags. |
Version | 1.0.11 |
License | BSD |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Checkout URI | https://github.com/ros-planning/moveit.git |
VCS Type | git |
VCS Version | melodic-devel |
Last Updated | 2022-09-13 |
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
Additional Links
Maintainers
- Jon Binney
- Michael Ferguson
- MoveIt! Release Team
Authors
- Ioan Sucan
- Dave Coleman
- Sachin Chitta
Changelog for package moveit_ros_visualization
1.0.11 (2022-09-13)
1.0.10 (2022-03-06)
1.0.9 (2022-01-09)
- Move
MoveItErrorCode
class tomoveit_core
(#3009) - Contributors: Michael G