HKUST-Aerial-Robotics / FUEL

An Efficient Framework for Fast UAV Exploration
GNU General Public License v3.0
922 stars 194 forks source link

Segmentation fault (Address not mapped to object) #41

Open reem90 opened 2 years ago

reem90 commented 2 years ago

I am using Ubuntu 20.04 with ros noetic. I changed the nlopt library as described in the READMe file with no success. When I use the 2D Nav goal from RVIZ, the exploration node crashes. Hence, I tried to send a goal from the terminal instead of the 2D nav goal from RVIZ as follows:

rostopic pub /move_base_simple/goal geometry_msgs/PoseStamped "header:
  seq: 0
  stamp:
    secs: 0
    nsecs: 0
  frame_id: 'world'
pose:
  position:
    x: 3.0
    y: 2.0
    z: 0.0
  orientation:
    x: 0.0
    y: 0.0
    z: 0.0
    w: 1.0" 

However, I got the following output from the exploration node.

Stack trace (most recent call last):
#15   Object "[0xffffffffffffffff]", at 0xffffffffffffffff, in 
#14   Object "/workspaces/uc1_ws/devel/lib/exploration_manager/exploration_node", at 0x55b35919f7ad, in _start
#13   Object "/lib/x86_64-linux-gnu/libc.so.6", at 0x7f91b9093082, in __libc_start_main
#12   Object "/workspaces/uc1_ws/devel/lib/exploration_manager/exploration_node", at 0x55b35919fc04, in main
#11   Object "/opt/ros/noetic/lib/libroscpp.so", at 0x7f91b97ef21e, in ros::spin()
#10   Object "/opt/ros/noetic/lib/libroscpp.so", at 0x7f91b9806fce, in ros::SingleThreadedSpinner::spin(ros::CallbackQueue*)
#9    Object "/opt/ros/noetic/lib/libroscpp.so", at 0x7f91b97b3882, in ros::CallbackQueue::callAvailable(ros::WallDuration)
#8    Object "/opt/ros/noetic/lib/libroscpp.so", at 0x7f91b97b2171, in ros::CallbackQueue::callOneCB(ros::CallbackQueue::TLS*)
#7    Object "/opt/ros/noetic/lib/libroscpp.so", at 0x7f91b9790607, in ros::TimerManager<ros::Time, ros::Duration, ros::TimerEvent>::TimerQueueCallback::call()
#6    Object "/workspaces/uc1_ws/devel/lib/exploration_manager/exploration_node", at 0x55b3591a8877, in boost::detail::function::void_function_obj_invoker1<boost::_bi::bind_t<void, boost::_mfi::mf1<void, fast_planner::FastExplorationFSM, ros::TimerEvent const&>, boost::_bi::list2<boost::_bi::value<fast_planner::FastExplorationFSM*>, boost::arg<1> > >, void, ros::TimerEvent const&>::invoke(boost::detail::function::function_buffer&, ros::TimerEvent const&)
#5    Object "/workspaces/uc1_ws/devel/lib/exploration_manager/exploration_node", at 0x55b3591a5799, in fast_planner::FastExplorationFSM::FSMCallback(ros::TimerEvent const&)
#4    Object "/workspaces/uc1_ws/devel/lib/exploration_manager/exploration_node", at 0x55b3591a4b14, in fast_planner::FastExplorationFSM::callExplorationPlanner()
#3    Object "/workspaces/uc1_ws/devel/lib/exploration_manager/exploration_node", at 0x55b3591b72fe, in fast_planner::FastExplorationManager::planExploreMotion(Eigen::Matrix<double, 3, 1, 0, 3, 1> const&, Eigen::Matrix<double, 3, 1, 0, 3, 1> const&, Eigen::Matrix<double, 3, 1, 0, 3, 1> const&, Eigen::Matrix<double, 3, 1, 0, 3, 1> const&)
#2    Object "/workspaces/uc1_ws/devel/lib/libplan_manage.so", at 0x7f91b9a25562, in fast_planner::FastPlannerManager::kinodynamicReplan(Eigen::Matrix<double, 3, 1, 0, 3, 1> const&, Eigen::Matrix<double, 3, 1, 0, 3, 1> const&, Eigen::Matrix<double, 3, 1, 0, 3, 1> const&, Eigen::Matrix<double, 3, 1, 0, 3, 1> const&, Eigen::Matrix<double, 3, 1, 0, 3, 1> const&, double const&)
#1    Object "/workspaces/uc1_ws/devel/lib/libpath_searching.so", at 0x7f91b9951d98, in fast_planner::KinodynamicAstar::search(Eigen::Matrix<double, 3, 1, 0, 3, 1>, Eigen::Matrix<double, 3, 1, 0, 3, 1>, Eigen::Matrix<double, 3, 1, 0, 3, 1>, Eigen::Matrix<double, 3, 1, 0, 3, 1>, Eigen::Matrix<double, 3, 1, 0, 3, 1>, bool, bool, double)
#0    Object "/workspaces/uc1_ws/devel/lib/libpath_searching.so", at 0x7f91b994bc5d, in fast_planner::KinodynamicAstar::stateTransit(Eigen::Matrix<double, 6, 1, 0, 6, 1>&, Eigen::Matrix<double, 6, 1, 0, 6, 1>&, Eigen::Matrix<double, 3, 1, 0, 3, 1>, double)
Segmentation fault (Address not mapped to object [0x3e8])

Kindly assist with the segmentation fault related to Segmentation fault (Address not mapped to object [0x3e8]) @ZbyLGsc @ShreyanshDarshan @danigr99727 @jackykongfz