Coder Social home page Coder Social logo

sbgisen / moveit Goto Github PK

View Code? Open in Web Editor NEW

This project forked from moveit/moveit

0.0 1.0 1.0 68.54 MB

:robot: The MoveIt motion planning framework

Home Page: http://moveit.ros.org/

License: BSD 3-Clause "New" or "Revised" License

CMake 1.94% Python 3.40% C++ 94.16% C 0.03% Makefile 0.01% GDB 0.01% HTML 0.01% Shell 0.26% Dockerfile 0.07% NASL 0.03% TeX 0.09%

moveit's Introduction

MoveIt Logo

The MoveIt Motion Planning Framework for ROS. For the ROS 2 repository see MoveIt 2. For the commercially supported version see MoveIt Pro.

Easy-to-use open source robotics manipulation platform for developing commercial applications, prototyping designs, and benchmarking algorithms.

Branches Policy

  • We develop latest features on master.
  • The *-devel branches correspond to released and stable versions of MoveIt for specific distributions of ROS. noetic-devel is synced to master currently.
  • Bug fixes occasionally get backported to these released versions of MoveIt.
  • To facilitate compile-time switching, the patch version of MOVEIT_VERSION of a development branch will be incremented by 1 w.r.t. the package.xml's version number.

MoveIt Status

Continuous Integration

service Melodic Master
GitHub Format CI Format CI
CodeCov codecov codecov
build farm Build Status Build Status
Docker
Pulls
automated build docker

Licenses

FOSSA Status

ROS Buildfarm

MoveIt Package Melodic Source Melodic Debian Noetic Source Noetic Debian
moveit Build Status Build Status Build Status Build Status
moveit_core Build Status Build Status Build Status Build Status
moveit_kinematics Build Status Build Status Build Status Build Status
moveit_planners Build Status Build Status Build Status Build Status
moveit_planners_ompl Build Status Build Status Build Status Build Status
moveit_planners_chomp Build Status Build Status Build Status Build Status
chomp_motion_planner Build Status Build Status Build Status Build Status
moveit_chomp_optimizer_adapter Build Status Build Status Build Status Build Status
pilz_industrial_motion_planner Build Status Build Status Build Status Build Status
pilz_industrial_motion_planner_testutils Build Status Build Status Build Status Build Status
moveit_plugins Build Status Build Status Build Status Build Status
moveit_fake_controller_manager Build Status Build Status Build Status Build Status
moveit_simple_controller_manager Build Status Build Status Build Status Build Status
moveit_ros_control_interface Build Status Build Status Build Status Build Status
moveit_ros Build Status Build Status Build Status Build Status
moveit_ros_planning Build Status Build Status Build Status Build Status
moveit_ros_move_group Build Status Build Status Build Status Build Status
moveit_ros_planning_interface Build Status Build Status Build Status Build Status
moveit_ros_benchmarks Build Status Build Status Build Status Build Status
moveit_ros_perception Build Status Build Status Build Status Build Status
moveit_ros_occupancy_map_monitor Build Status Build Status Build Status Build Status
moveit_ros_manipulation Build Status Build Status Build Status Build Status
moveit_ros_robot_interaction Build Status Build Status Build Status Build Status
moveit_ros_visualization Build Status Build Status Build Status Build Status
moveit_ros_warehouse Build Status Build Status Build Status Build Status
moveit_servo Build Status Build Status Build Status Build Status
moveit_runtime Build Status Build Status Build Status Build Status
moveit_commander Build Status Build Status Build Status Build Status
moveit_setup_assistant Build Status Build Status Build Status Build Status
moveit_msgs Build Status Build Status Build Status Build Status
geometric_shapes Build Status Build Status Build Status Build Status
srdfdom Build Status Build Status Build Status Build Status
moveit_visual_tools Build Status Build Status Build Status Build Status
moveit_tutorials Build Status Build Status

Stargazers over time

Stargazers over time

moveit's People

Contributors

rhaschke avatar davetcoleman avatar isucan avatar v4hn avatar sachinchitta avatar 130s avatar mikeferguson avatar tylerjw avatar velveteenrobot avatar henningkayser avatar felixvd avatar mathias-luedtke avatar bmagyar avatar andyze avatar de-vri-es avatar hersh avatar gavanderhoorn avatar simonschmeisser avatar jrgnicho avatar julienking avatar brycestevenwilley avatar adampettinger avatar jafarabdi avatar mlautman avatar mintar avatar jspricke avatar j-petit avatar nyxrobotics avatar mayman99 avatar jsupratman13 avatar

Watchers

James Cloos avatar

Forkers

jsupratman13

moveit's Issues

[ERROR] [/rviz]: a message of over a gigabyte was predicted in tcpros. that seems highly unlikely, so I'll assume protocol synchronization is lost.

Description

#12 seems to have caused this to happen
When I get this error, the mouse stops working in Ubuntu and I have to reboot.

It seems that this error occurs when there are parts of the array that fail to initialize
Reference: ros(29):a message of over a gigabyte was predicted in tcpros. that seems highly unlikely, so I‘ll as

Your environment

  • ROS Distro: [Noetic]
  • OS Version: e.g. Ubuntu 20.04
  • Source sbgisen/noetic-devel

Imported target "Boost::system" includes non-existent path

概要

Starting  >>> catkin_tools_prebuild                                                                                                                                                                               
Finished  <<< catkin_tools_prebuild                                   [ 1.0 seconds ]                                                                                                                             
Starting  >>> moveit_core                                                                                                                                                                                         
Starting  >>> ompl                                                                                                                                                                                                
__________________________________________________________________________________________________________________________________________________________________________________________________________________
Errors     << moveit_core:cmake /home/soar/ros/logs/moveit_core/build.cmake.000.log                                                                                                                               
TODO: Analyse and fix gcc's maybe-uninitialized warnings
CMake Error in exceptions/CMakeLists.txt:
  Imported target "Boost::system" includes non-existent path

    "/include"

  in its INTERFACE_INCLUDE_DIRECTORIES.  Possible reasons include:

  * The path was deleted, renamed, or moved to another location.

  * An install or uninstall procedure did not complete successfully.

  * The installation package was faulty and references files it does not
  provide.

According to https://stackoverflow.com/questions/70585114/imported-target-boostsystem-includes-non-existent-path-include boost cmake are searching for include in /include when it should be /usr/include. Not sure when and why this happens but for now the work around for this is create a symbolic link

sudo ln -s /usr/include /include

再現手順
修正しないとどう困るか
原因
修正案

Move group can't connect to rviz on gazebo

Description

Occurs after #13
Move group does not connect to rviz when starting robot on gazebo
Occurs about once every 5 times

[ERROR] [/rviz]: Unable to connect to move_group action server 'move_group' within allotted time (30s)
[ERROR] [/rviz]: Exception caught while processing action 'Frame::changePlanningGroup': boost: mutex lock failed in pthread_mutex_lock: Invalid argument

Add option to use padded robot for self-collisions

Summary
Import parameters to set the avoidance distance for each link when planning with moveit.
You can read more about it in the PR I wrote in the Reference.

Purpose

  • Enable/Disable self-collision checking
  • Prevent self collision in the moveit operation.

Reference

self mesh filter ignores orientation

Description

Self-mesh filter does not filter all of the robot's arm. Depending on the robot arm's pose, some links are not excluded. Assume that the mesh filter might not take into consideration to link's orientation.

CPU usage of rviz increases when running for long periods

Summary
Since the 814908b pull request, the cpu usage of rviz has been increasing over time.
I went back and verified the commits one by one, it seems to be caused by commit d98a529

Reproduction Procedure
Start rviz, moveit, and the gazebo environment.

How to fix it
Revert d98a529

Cause
I don't know what this commit is needed for or why this caused the bug
It's hard to see the commit log

Proposed fix
Revert d98a529

planning scene object collide with octomap

Ideally, if an object in the planning scene overlaps the octomap, the boxes overlapping the object should be removed like the one below.
This is the core feature.

Screenshot from 2023-09-29 19-30-30

However, here are some examples where the boxes still overlaps with the object even after the cut out process is done.
Screenshot from 2023-09-29 19-30-07

I believe that this is because the robot or the sensor updating the octomap cannot see the overlapped boxes at that moment; hence the boxes are not removed. Here is an example where the generated octomap that is not updated because obstacle is not in view, are not removed even if the object overlaps with the octomap

Screenshot from 2023-09-29 19-29-39

Enabling debug_info_ causes topics with different encodings to be published in duplicate each time

Description

As the title says, filtered_cloud is published in duplicate each time

pub_filtered_depth_image_.publish(filtered_depth_msg, *info_msg);

pub_filtered_depth_image_.publish(filtered_msg, *info_msg);

I want to make it an option whether to delete all scene objects from octomap or not

For example, when removing an object from a shelf, you do not want to exclude it from the octomap because you want to avoid the shelf as an obstacle.
However, we want to exclude the object to be grasped from the octomap.
Also, when placing an object somewhere, we want to exclude the support surface from the octomap.
We would like to create a mechanism that allows us to remove the octomap only for the specified area or objects.
First, to prevent all scenes from being removed from the octomap, we need to be able to disable this function with a parameter.

filtered_cloud is incorrect

Description

If you set debug to true in move_group.launch, you can see filtered_cloud in rviz
This filtered_cloud automatically removes the robot's own model and the model of the scene added with rviz
However, this model is not fully removed and there is a point cloud that is not removed as shown in the image

Screenshot from 2024-05-14 11-59-54

Your environment

  • ROS Distro: [Kinetic|Melodic|Noetic]
  • OS Version: e.g. Ubuntu 18.04
  • Source or Binary build?
  • If binary, which release version?
  • If source, which branch?

Steps to reproduce

Tell us how to reproduce this issue. Attempt to provide a working demo, perhaps using Docker.

Expected behaviour

Tell us what should happen

Actual behaviour

Tell us what happens instead

Backtrace or Console output

Use gist.github.com to copy-paste the console output or segfault backtrace using gdb.

Recommend Projects

  • React photo React

    A declarative, efficient, and flexible JavaScript library for building user interfaces.

  • Vue.js photo Vue.js

    🖖 Vue.js is a progressive, incrementally-adoptable JavaScript framework for building UI on the web.

  • Typescript photo Typescript

    TypeScript is a superset of JavaScript that compiles to clean JavaScript output.

  • TensorFlow photo TensorFlow

    An Open Source Machine Learning Framework for Everyone

  • Django photo Django

    The Web framework for perfectionists with deadlines.

  • D3 photo D3

    Bring data to life with SVG, Canvas and HTML. 📊📈🎉

Recommend Topics

  • javascript

    JavaScript (JS) is a lightweight interpreted programming language with first-class functions.

  • web

    Some thing interesting about web. New door for the world.

  • server

    A server is a program made to process requests and deliver data to clients.

  • Machine learning

    Machine learning is a way of modeling and interpreting data that allows a piece of software to respond intelligently.

  • Game

    Some thing interesting about game, make everyone happy.

Recommend Org

  • Facebook photo Facebook

    We are working to build community through open source technology. NB: members must have two-factor auth.

  • Microsoft photo Microsoft

    Open source projects and samples from Microsoft.

  • Google photo Google

    Google ❤️ Open Source for everyone.

  • D3 photo D3

    Data-Driven Documents codes.