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 2024-04-18
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

Components of MoveIt that offer interaction via interactive markers

Additional Links

Maintainers

  • Michael Ferguson
  • Robert Haschke
  • MoveIt Release Team

Authors

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

Changelog for package moveit_ros_robot_interaction

1.1.13 (2023-07-28)

1.1.12 (2023-05-13)

1.1.11 (2022-12-21)

1.1.10 (2022-09-13)

  • Find end-effectors for empty parent_group (#3108)
  • Replace bind() with lambdas (#3106)
  • Consider eef\'s parent group when creating eef markers (#3095)
  • Contributors: Michael G

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

Plugins

No plugins found.

Recent questions tagged moveit_ros_robot_interaction 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

Components of MoveIt! that offer interaction via interactive markers

Additional Links

Maintainers

  • Michael Ferguson
  • Robert Haschke
  • MoveIt! Release Team

Authors

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

Changelog for package moveit_ros_robot_interaction

0.9.18 (2020-01-24)

0.9.17 (2019-07-09)

0.9.16 (2019-06-29)

  • [maintanance] Resolve catkin lint issues (#1137)
  • Contributors: Ludovic Delval

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)

  • [fix] Text refrences to MoveIt! (#1020)
  • Contributors: Mohmmad Ayman, Robert Haschke, mike lautman

0.9.12 (2018-05-29)

  • [fix] interaction with planar joints (#767)
  • [maintenance] boost::shared_ptr -> std::shared_ptr
  • [enhance] association of IK solvers to groups #769
  • Contributors: Bence Magyar, Ian McMahon, Michael G

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

Plugins

No plugins found.

Recent questions tagged moveit_ros_robot_interaction 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

Components of MoveIt that offer interaction via interactive markers

Additional Links

Maintainers

  • Ioan Sucan
  • Michael Ferguson

Authors

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

Changelog for package moveit_ros_robot_interaction

0.8.7 (2017-04-03)

  • [fix] [catkin_make -DCMAKE_ENABLE_TESTING=0]{.title-ref} failure (#478)
  • address gcc6 build error (#458)
  • Contributors: Dave Coleman, Michael Goerner, Dmitry Rozhkov

0.8.6 (2017-03-08)

0.8.4 (2017-02-06)

  • [maintenance] Use MOVEIT_CLASS_FORWARD for moveit classes in moveit_ros. (#182)
  • [maintenance] Remove const& from getKinematicsQueryOptions to fix warning (#129)
  • Contributors: Andreas Koepf, Dave Coleman, Isaac I.Y. Saito, Maarten de Vries

0.8.3 (2016-08-19)

0.6.6 (2016-06-08)

  • use getModelFrame() as reference frame for markers
  • publish markers relative to robot\'s root frame In addition to #669, interactive markers need to be place relative to the robot\'s root frame. If nothing is specified (as before), rviz\' fixed frame is used, leading to offsets when both frames are not identical.
  • merge indigo-devel changes (PR #633 trailing whitespace) into jade-devel
  • Removed trailing whitespace from entire repository
  • further adapted marker size computation

    • drop largest extension dimension (-> use cross-section size of elongated link)

    - for an end-effector group, consider the sizes of individual links instead of the overall size of all links (which becomes huge very fast) - enlarge marker size by factor of 1.5 when there is only a single eef marker

  • reworked computeLinkMarkerSize() compute size such that the marker sphere will cover

    • a spherical link geometry -> AABB.maxCoeff

    - a cubical link geometry -> AABB.norm -> use average of both values Virtual links (without any shape) will have a size of AABB of zero dims. In this case use the dimensions of the closest parent link instead.

  • improved computation of interactive marker size

    • use parent_link if group == parent_group
    • scale smaller than 5cm is clipped to 5cm instead of using default
    • clarified size computation, using diameter of AABB
  • fixing error caused by BOOST_STATIC_ASSERT

  • Fixed compile error caused by BOOST_STATIC_ASSERT in kinematic_options.cpp Added kinematics::DiscretizationMethods::DiscretizationMethod to QO_FIELDS in kinematic_options.cpp. At pull request #581, type of discretization_method was set to int. Changed it to proper type.

  • reinstated changes related to the updates in the moveit_core::KinematicsBase interface

  • Revert \" Kinematics Base changes in moveit_core\"

  • adds the \'returns_approximate_solution\' entry so that it is compatible with the changes in kinematics::KinematicsBase class in the moveit_core repo

  • Contributors: Daichi Yoshikawa, Dave Coleman, Robert Haschke, Sachin Chitta, jrgnicho

0.6.5 (2015-01-24)

  • update maintainers
  • Contributors: Michael Ferguson

0.6.4 (2014-12-20)

0.6.3 (2014-12-03)

0.6.2 (2014-10-31)

0.6.1 (2014-10-31)

0.6.0 (2014-10-27)

  • Fix coding style according to the moveit style
  • update joystick documentation according to the latest implementation
  • add checkbox to toggle if moveit rviz plugin subscribes the topics to be used for communication to the external ros nodes. update moveit_joy.py to parse srdf to know planning_groups and the names of the end effectors and support multi-endeffector planning groups.
  • adding PoseStamped topic to move the interactive marker from other ros nodes such as joystick programs.
  • Contributors: Ryohei Ueda, Sachin Chitta

0.5.19 (2014-06-23)

  • Fix [-Wreorder] warning.
  • Allow planning groups to have more than one tip
  • Contributors: Adolfo Rodriguez Tsouroukdissian, Dave Coleman

0.5.18 (2014-03-23)

0.5.17 (2014-03-22)

  • update maintainer e-mail
  • Contributors: Ioan Sucan

0.5.16 (2014-02-27)

  • fix test This was testing functionality that got removed. Removed that part of the test.
  • robot_interaction: add comments Comment cryptic public function behavior.
  • robot_interaction: fix formatting remove tabs and whitespace at the end of lines.
  • robot_interaction: fix comment formatting Limit lines to 120 chars max (80 preferred in headers).
  • robot_interaction: fix setStateFromIK prototypes use references instead of pointers.
  • robot_interaction: fix header problems fix getRobotModel() bug make internal functions private.
  • remove extraneous code
  • add missing headers
  • robot_interaction: Fix issues raised by Ioan
  • robot_interaction: use LockedRobotState Fix a number of thread safety violations.
  • robot_interaction: add LockedRobotState and tests
  • robot_interaction: use KinematicOptionsMap Fixes threading issues. Separate the handling of kinematics options into a separate object which enforces thread safe access.
  • robot_interaction: add KinematicOptions KinematicOptions contains the parameters needed to call RobotState::setFromIK. KinematicOptionsMap contains a map of string->KinematicOptions a default KinematicOptions. These are useful in RobotInteraction with the group name as the key.
  • pull RobotInteraction structures out of class The Generic, EndEffector, and Joint structures complicate the core of RobotInteraction. Pull them out to simplify the code. This will also help with future plans to make the core of RobotInteraction more generic and flexible.
  • fix include guards to match moveit conventions
  • robot_interaction: include interaction_handler.h from robot_interaction.h This is for backwards compatibility with code that only includes robot_interaction.h
  • robot_interaction: split handler into own file
  • robot_interaction: split InteractionHandler into its own file
  • robot_interaction: make lock-protected members private Since the lock is needed to access these and the lock is private it makes no sense for them to be protected.
  • robot_interaction: add locking comments
  • robot_interaction: simplify code
  • robot_interaction: fix comments
  • Contributors: Acorn Pooley

0.5.14 (2014-02-06)

0.5.13 (2014-02-06)

0.5.12 (2014-01-03)

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

0.5.11 (2014-01-03)

0.5.10 (2013-12-08)

0.5.9 (2013-12-03)

  • adds KDL link directories to robot_interaction/CMakeLists.txt (fixes #376)
  • fixed computation of dimension_.
  • fixes for mimic joints and redundant joints

0.5.8 (2013-10-11)

0.5.7 (2013-10-01)

0.5.6 (2013-09-26)

0.5.5 (2013-09-23)

  • porting to new RobotState API

0.5.4 (2013-08-14)

  • make headers and author definitions aligned the same way; white space fixes
  • fix #283

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)
  • adding options struct to kinematics base

0.4.5 (2013-07-03)

0.4.4 (2013-06-26)

  • bugfixes
  • robot_interaction: include sphere markers by default
  • use improved MOVE_ROTATE_3D marker

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

Plugins

No plugins found.

Recent questions tagged moveit_ros_robot_interaction 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

Components of MoveIt that offer interaction via interactive markers

Additional Links

Maintainers

  • Michael Ferguson
  • Robert Haschke
  • MoveIt! Release Team

Authors

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

Changelog for package moveit_ros_robot_interaction

0.7.14 (2018-10-20)

0.7.13 (2017-12-25)

0.7.12 (2017-08-06)

0.7.11 (2017-06-21)

0.7.10 (2017-06-07)

0.7.9 (2017-04-03)

  • [fix] gcc6 build error (#471, #458)
  • Contributors: Michael Goerner

0.7.8 (2017-03-08)

  • [fix][moveit_ros_warehouse] gcc6 build error #423
  • Contributors: Dmitry Rozhkov

0.7.7 (2017-02-06)

  • [maintenance] 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)

0.7.3 (2016-12-20)

0.7.2 (2016-06-20)

  • cherry-pick 04e158aca from jade-devel

    • use getModelFrame() as reference frame for markers

    - always (re)create collision object marker (other properties than pose (such as name of the marker) need to be adapted too)

  • publish markers relative to robot\'s root frame In addition to #669, interactive markers need to be place relative to the robot\'s root frame. If nothing is specified (as before), rviz\' fixed frame is used, leading to offsets when both frames are not identical.

  • Contributors: Robert Haschke

0.7.1 (2016-04-11)

0.7.0 (2016-01-30)

  • Removed trailing whitespace from entire repository
  • further adapted marker size computation

    • drop largest extension dimension (-> use cross-section size of elongated link)

    - for an end-effector group, consider the sizes of individual links instead of the overall size of all links (which becomes huge very fast) - enlarge marker size by factor of 1.5 when there is only a single eef marker

  • reworked computeLinkMarkerSize() compute size such that the marker sphere will cover

    • a spherical link geometry -> AABB.maxCoeff

    - a cubical link geometry -> AABB.norm -> use average of both values Virtual links (without any shape) will have a size of AABB of zero dims. In this case use the dimensions of the closest parent link instead.

  • improved computation of interactive marker size

    • use parent_link if group == parent_group
    • scale smaller than 5cm is clipped to 5cm instead of using default
    • clarified size computation, using diameter of AABB
  • fixing error caused by BOOST_STATIC_ASSERT

  • Fixed compile error caused by BOOST_STATIC_ASSERT in kinematic_options.cpp Added kinematics::DiscretizationMethods::DiscretizationMethod to QO_FIELDS in kinematic_options.cpp. At pull request #581, type of discretization_method was set to int. Changed it to proper type.

  • reinstated changes related to the updates in the moveit_core::KinematicsBase interface

  • adds the \'returns_approximate_solution\' entry so that it is compatible with the changes in kinematics::KinematicsBase class in the moveit_core repo

  • Contributors: Daichi Yoshikawa, Dave Coleman, Robert Haschke, Sachin Chitta, jrgnicho

0.6.5 (2015-01-24)

  • update maintainers
  • Contributors: Michael Ferguson

0.6.4 (2014-12-20)

0.6.3 (2014-12-03)

0.6.2 (2014-10-31)

0.6.1 (2014-10-31)

0.6.0 (2014-10-27)

  • Fix coding style according to the moveit style
  • update joystick documentation according to the latest implementation
  • add checkbox to toggle if moveit rviz plugin subscribes the topics to be used for communication to the external ros nodes. update moveit_joy.py to parse srdf to know planning_groups and the names of the end effectors and support multi-endeffector planning groups.
  • adding PoseStamped topic to move the interactive marker from other ros nodes such as joystick programs.
  • Contributors: Ryohei Ueda, Sachin Chitta

0.5.19 (2014-06-23)

  • Fix [-Wreorder] warning.
  • Allow planning groups to have more than one tip
  • Contributors: Adolfo Rodriguez Tsouroukdissian, Dave Coleman

0.5.18 (2014-03-23)

0.5.17 (2014-03-22)

  • update maintainer e-mail
  • Contributors: Ioan Sucan

0.5.16 (2014-02-27)

  • fix test This was testing functionality that got removed. Removed that part of the test.
  • robot_interaction: add comments Comment cryptic public function behavior.
  • robot_interaction: fix formatting remove tabs and whitespace at the end of lines.
  • robot_interaction: fix comment formatting Limit lines to 120 chars max (80 preferred in headers).
  • robot_interaction: fix setStateFromIK prototypes use references instead of pointers.
  • robot_interaction: fix header problems fix getRobotModel() bug make internal functions private.
  • remove extraneous code
  • add missing headers
  • robot_interaction: Fix issues raised by Ioan
  • robot_interaction: use LockedRobotState Fix a number of thread safety violations.
  • robot_interaction: add LockedRobotState and tests
  • robot_interaction: use KinematicOptionsMap Fixes threading issues. Separate the handling of kinematics options into a separate object which enforces thread safe access.
  • robot_interaction: add KinematicOptions KinematicOptions contains the parameters needed to call RobotState::setFromIK. KinematicOptionsMap contains a map of string->KinematicOptions a default KinematicOptions. These are useful in RobotInteraction with the group name as the key.
  • pull RobotInteraction structures out of class The Generic, EndEffector, and Joint structures complicate the core of RobotInteraction. Pull them out to simplify the code. This will also help with future plans to make the core of RobotInteraction more generic and flexible.
  • fix include guards to match moveit conventions
  • robot_interaction: include interaction_handler.h from robot_interaction.h This is for backwards compatibility with code that only includes robot_interaction.h
  • robot_interaction: split handler into own file
  • robot_interaction: split InteractionHandler into its own file
  • robot_interaction: make lock-protected members private Since the lock is needed to access these and the lock is private it makes no sense for them to be protected.
  • robot_interaction: add locking comments
  • robot_interaction: simplify code
  • robot_interaction: fix comments
  • Contributors: Acorn Pooley

0.5.14 (2014-02-06)

0.5.13 (2014-02-06)

0.5.12 (2014-01-03)

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

0.5.11 (2014-01-03)

0.5.10 (2013-12-08)

0.5.9 (2013-12-03)

  • adds KDL link directories to robot_interaction/CMakeLists.txt (fixes #376)
  • fixed computation of dimension_.
  • fixes for mimic joints and redundant joints

0.5.8 (2013-10-11)

0.5.7 (2013-10-01)

0.5.6 (2013-09-26)

0.5.5 (2013-09-23)

  • porting to new RobotState API

0.5.4 (2013-08-14)

  • make headers and author definitions aligned the same way; white space fixes
  • fix #283

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)
  • adding options struct to kinematics base

0.4.5 (2013-07-03)

0.4.4 (2013-06-26)

  • bugfixes
  • robot_interaction: include sphere markers by default
  • use improved MOVE_ROTATE_3D marker

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

Plugins

No plugins found.

Recent questions tagged moveit_ros_robot_interaction 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

Components of MoveIt! that offer interaction via interactive markers

Additional Links

Maintainers

  • Michael Ferguson
  • Robert Haschke
  • MoveIt! Release Team

Authors

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

Changelog for package moveit_ros_robot_interaction

0.9.18 (2020-01-24)

0.9.17 (2019-07-09)

0.9.16 (2019-06-29)

  • [maintanance] Resolve catkin lint issues (#1137)
  • Contributors: Ludovic Delval

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)

  • [fix] Text refrences to MoveIt! (#1020)
  • Contributors: Mohmmad Ayman, Robert Haschke, mike lautman

0.9.12 (2018-05-29)

  • [fix] interaction with planar joints (#767)
  • [maintenance] boost::shared_ptr -> std::shared_ptr
  • [enhance] association of IK solvers to groups #769
  • Contributors: Bence Magyar, Ian McMahon, Michael G

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

Plugins

No plugins found.

Recent questions tagged moveit_ros_robot_interaction at Robotics Stack Exchange

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

Components of MoveIt! that offer interaction via interactive markers

Additional Links

Maintainers

  • Michael Ferguson
  • Robert Haschke
  • MoveIt! Release Team

Authors

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

Changelog for package moveit_ros_robot_interaction

1.0.11 (2022-09-13)

1.0.10 (2022-03-06)

1.0.9 (2022-01-09)

1.0.8 (2021-05-23)

  • Suppress warnings \"mesh_use_embedded_materials is ignored\"
  • Contributors: Robert Haschke

1.0.7 (2020-11-20)

  • [maint] Add comment to MOVEIT_CLASS_FORWARD (#2315)
  • Contributors: Felix von Drigalski

1.0.6 (2020-08-19)

  • [maint] Migrate to clang-format-10
  • [maint] Optimize includes (#2229)
  • Contributors: Markus Vieth, Robert Haschke

1.0.5 (2020-07-08)

1.0.4 (2020-05-30)

1.0.3 (2020-04-26)

  • [maint] Apply clang-tidy fix to entire code base (#1394)
  • [maint] Fix errors: catkin_lint 1.6.7 (#1987)
  • [maint] Windows build: Fix binary artifact install locations. (#1575)
  • [maint] Use CMAKE_CXX_STANDARD to enforce c++14 (#1607)
  • Contributors: Robert Haschke, Sean Yen, Yu, Yan

1.0.2 (2019-06-28)

1.0.1 (2019-03-08)

  • [improve] Apply clang tidy fix to entire code base (Part 1) (#1366)
  • Contributors: Yu, Yan

1.0.0 (2019-02-24)

  • [fix] catkin_lint issues (#1341)
  • [improve] Remove (redundant) random seeding and #attempts from RobotState::setFromIK() as the IK solver perform random seeding themselves. #1288
  • [improve] cleanup RobotInteraction (#1287)
  • [improve] limit IK timeout to 0.1s for a responsive interaction behaviour (#1291)
  • Contributors: Robert Haschke

0.10.8 (2018-12-24)

0.10.7 (2018-12-13)

0.10.6 (2018-12-09)

  • [maintenance] Replaced Eigen::Affine3d -> Eigen::Isometry3d (#1096)
  • [maintenance] Use C++14 (#1146)
  • [maintenance] Cleanup Robot Interaction (#1194)
    • Remove deprecated handling of own KinematicsOptionsMap
    • Use normalized quaternions
  • [maintenance] Code Cleanup
  • Contributors: Alex Moriarty, Dave Coleman, Michael G

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

Plugins

No plugins found.

Recent questions tagged moveit_ros_robot_interaction at Robotics Stack Exchange