-
Notifications
You must be signed in to change notification settings - Fork 118
move_group crashes frequently on current MoveIt! .deb install/Indigo #542
Comments
Related discussion also here: https://groups.google.com/forum/#!topic/moveit-users/M71T-GaUNgg Comparison videos between ROS distros showing that the issue only pops up on Indigo here: |
Here's some output, generated by starting the demo.launch and clicking "Plan" frequently. The crash happens inside OMPL and it appears to crash always at the same code section. This was done with a RelWithDebInfo build of latest moveit_core, moveit_ros and moveit_msgs indigo-devel branches and rest installed from .debs on 14.04/Ros Indigo/AMD64 0 ompl::Grid::CellData*>::neighbors(std::vector >&, std::vector::CellData*>::Cell*, std::allocator::CellData*>::Cell*> >&) const /opt/ros/indigo/lib/x86_64-linux-gnu/libompl.so.10 0x7f9d3fc3f340 1 ompl::GridN::CellData*>::neighbors(std::vector >&, std::vector::CellData*>::Cell*, std::allocator::CellData*>::Cell*> >&) const /opt/ros/indigo/lib/x86_64-linux-gnu/libompl.so.10 0x7f9d3fc3f5b0 2 ompl::GridB::CellData*, ompl::geometric::Discretization::OrderCellsByImportance, ompl::geometric::Discretization::OrderCellsByImportance>::createCell(std::vector > const&, std::vector::CellData*>::Cell*, std::allocator::CellData*>::Cell*> >*) /opt/ros/indigo/lib/x86_64-linux-gnu/libompl.so.10 0x7f9d3fc3f724 3 ompl::geometric::Discretization::addMotion(ompl::geometric::LBKPIECE1::Motion*, std::vector > const&, double) /opt/ros/indigo/lib/x86_64-linux-gnu/libompl.so.10 0x7f9d3fc419dd 4 ompl::geometric::LBKPIECE1::solve(ompl::base::PlannerTerminationCondition const&) /opt/ros/indigo/lib/x86_64-linux-gnu/libompl.so.10 0x7f9d3fc3c332 5 ompl::tools::ParallelPlan::solveMore(ompl::base::Planner*, unsigned long, unsigned long, ompl::base::PlannerTerminationCondition const*) /opt/ros/indigo/lib/x86_64-linux-gnu/libompl.so.10 0x7f9d3fcddfc5 6 ?? /usr/lib/x86_64-linux-gnu/libboost_thread.so.1.54.0 0x7f9d748e8a4a 7 start_thread 312 0x7f9d78291182 8 clone 111 0x7f9d77899efd 0 ompl::Grid::CellData*>::neighbors(std::vector >&, std::vector::CellData*>::Cell*, std::allocator::CellData*>::Cell*> >&) const /opt/ros/indigo/lib/x86_64-linux-gnu/libompl.so.10 0x7f33ff724340 1 ompl::GridN::CellData*>::neighbors(std::vector >&, std::vector::CellData*>::Cell*, std::allocator::CellData*>::Cell*> >&) const /opt/ros/indigo/lib/x86_64-linux-gnu/libompl.so.10 0x7f33ff7245b0 2 ompl::GridB::CellData*, ompl::geometric::Discretization::OrderCellsByImportance, ompl::geometric::Discretization::OrderCellsByImportance>::createCell(std::vector > const&, std::vector::CellData*>::Cell*, std::allocator::CellData*>::Cell*> >*) /opt/ros/indigo/lib/x86_64-linux-gnu/libompl.so.10 0x7f33ff724724 3 ompl::geometric::Discretization::addMotion(ompl::geometric::LBKPIECE1::Motion*, std::vector > const&, double) /opt/ros/indigo/lib/x86_64-linux-gnu/libompl.so.10 0x7f33ff7269dd 4 ompl::geometric::LBKPIECE1::solve(ompl::base::PlannerTerminationCondition const&) /opt/ros/indigo/lib/x86_64-linux-gnu/libompl.so.10 0x7f33ff7214a7 5 ompl::tools::ParallelPlan::solveMore(ompl::base::Planner*, unsigned long, unsigned long, ompl::base::PlannerTerminationCondition const*) /opt/ros/indigo/lib/x86_64-linux-gnu/libompl.so.10 0x7f33ff7c2fc5 6 ?? /usr/lib/x86_64-linux-gnu/libboost_thread.so.1.54.0 0x7f34342cba4a 7 start_thread 312 0x7f3437c74182 8 clone 111 0x7f343727cefd |
The backtraces in the previous post were done with a (currently no publically available) 7DOF arm, but my Atlas 6DOF arm test setup linked in the original post crashes at the same location: 0 ompl::Grid::CellData*>::neighbors(std::vector >&, std::vector::CellData*>::Cell*, std::allocator::CellData*>::Cell*> >&) const /opt/ros/indigo/lib/x86_64-linux-gnu/libompl.so.10 0x7fd62bc3f340 1 ompl::GridN::CellData*>::neighbors(std::vector >&, std::vector::CellData*>::Cell*, std::allocator::CellData*>::Cell*> >&) const /opt/ros/indigo/lib/x86_64-linux-gnu/libompl.so.10 0x7fd62bc3f5b0 2 ompl::GridB::CellData*, ompl::geometric::Discretization::OrderCellsByImportance, ompl::geometric::Discretization::OrderCellsByImportance>::createCell(std::vector > const&, std::vector::CellData*>::Cell*, std::allocator::CellData*>::Cell*> >*) /opt/ros/indigo/lib/x86_64-linux-gnu/libompl.so.10 0x7fd62bc3f724 3 ompl::geometric::Discretization::addMotion(ompl::geometric::LBKPIECE1::Motion*, std::vector > const&, double) /opt/ros/indigo/lib/x86_64-linux-gnu/libompl.so.10 0x7fd62bc419dd 4 ompl::geometric::LBKPIECE1::solve(ompl::base::PlannerTerminationCondition const&) /opt/ros/indigo/lib/x86_64-linux-gnu/libompl.so.10 0x7fd62bc3c4a7 5 ompl::tools::ParallelPlan::solveMore(ompl::base::Planner*, unsigned long, unsigned long, ompl::base::PlannerTerminationCondition const*) /opt/ros/indigo/lib/x86_64-linux-gnu/libompl.so.10 0x7fd62bcddfc5 6 ?? /usr/lib/x86_64-linux-gnu/libboost_thread.so.1.54.0 0x7fd660b88a4a 7 start_thread 312 0x7fd66455d182 8 clone 111 0x7fd663b65efd |
move_group crashes frequently when doing simple planning in demo.launch for me. Complete setup I used is available here: https://github.com/skohlbr/simple_test_atlas_moveit
I am on Ubuntu 14.04/AMD64/latest Indigo .debs.
Three videos of running demo and move_group crashing either immediately or after very short time when planning:
https://www.youtube.com/watch?v=zyHQyD-U1Pw
https://www.youtube.com/watch?v=BjVD14ZYa4Y
https://www.youtube.com/watch?v=_D00n-xhMes
The text was updated successfully, but these errors were encountered: