Gazebo | Ignition | Community
Ask Your Question

Revision history [back]

click to hide/show revision 1
initial version

Segmentation fault on spawning pr2 with its controllers using pr2_controller_manager

I am trying to spawn pr2 urdf xacro model in gazebo along with its controllers using pr2_controller_manager. I am facing segmentation fault at :-

Thread 28 "gzserver" received signal SIGSEGV, Segmentation fault. [Switching to Thread 0x7fff63ffd700 (LWP 17825)] 0x00007fffc96ac0ed in ros::NodeHandle::destruct() () from /opt/ros/kinetic/lib/libroscpp.so

And it's backtrace is

** #0 0x00007fffc96ac0ed in ros::NodeHandle::destruct() () from /opt/ros/kinetic/lib/libroscpp.so

1 0x00007fffc96ac269 in ros::NodeHandle::~NodeHandle() () from /opt/ros/kinetic/lib/libroscpp.so

2 0x00007fff184b44b4 in pr2_controller_manager::ControllerManager::~ControllerManager() ()

from /home/deadmanlogan/i_am_from_source/catkin_ws/devel_isolated/pr2_controller_manager/lib/libpr2_controller_manager.so

3 0x00007fff184b4ed9 in pr2_controller_manager::ControllerManager::~ControllerManager() ()

from /home/deadmanlogan/i_am_from_source/catkin_ws/devel_isolated/pr2_controller_manager/lib/libpr2_controller_manager.so

4 0x00007fff105a580a in gazebo::GazeboRosControllerManager::~GazeboRosControllerManager() ()

from /home/deadmanlogan/i_am_from_source/catkin_ws/devel_isolated/pr2_gazebo_plugins/lib/libgazebo_ros_controller_manager.so

5 0x00007fff105a5996 in gazebo::GazeboRosControllerManager::~GazeboRosControllerManager() ()

from /home/deadmanlogan/i_am_from_source/catkin_ws/devel_isolated/pr2_gazebo_plugins/lib/libgazebo_ros_controller_manager.so

6 0x00007ffff5ba80c9 in boost::checked_delete<gazebo::modelplugin> (x=0x7fff0d794610) at /usr/include/boost/core/checked_delete.hpp:34

7 0x00007ffff5baadd6 in boost::detail::sp_counted_impl_p<gazebo::modelplugin>::dispose (this=0x7fff0d793db0)

at /usr/include/boost/smart_ptr/detail/sp_counted_impl.hpp:78

8 0x00007ffff59b4efe in boost::detail::sp_counted_base::release (this=0x7fff0d793db0)

at /usr/include/boost/smart_ptr/detail/sp_counted_base_gcc_x86.hpp:146

9 0x00007ffff59b4f91 in boost::detail::shared_count::~shared_count (this=0x7fff63ffb3d8, __in_chrg=<optimized out="">)

at /usr/include/boost/smart_ptr/detail/shared_count.hpp:443

10 0x00007ffff5b9f086 in boost::shared_ptr<gazebo::modelplugin>::~shared_ptr (this=0x7fff63ffb3d0, __in_chrg=<optimized out="">)

at /usr/include/boost/smart_ptr/shared_ptr.hpp:323

11 0x00007ffff5b9a392 in gazebo::physics::Model::LoadPlugin (this=0x7fff3c1794c0, _sdf=std::shared_ptr (count 3, weak 5) 0x7fff368df950)

at /home/deadmanlogan/i_am_from_source/Gazebo-7/gazebo/physics/Model.cc:1002

12 0x00007ffff5b999e2 in gazebo::physics::Model::LoadPlugins (this=0x7fff3c1794c0)

---Type <return> to continue, or q <return> to quit--- at /home/deadmanlogan/i_am_from_source/Gazebo-7/gazebo/physics/Model.cc:915

13 0x00007ffff5c08bd9 in gazebo::physics::World::ProcessFactoryMsgs (this=0x1654280)

at /home/deadmanlogan/i_am_from_source/Gazebo-7/gazebo/physics/World.cc:1958

14 0x00007ffff5c0b9de in gazebo::physics::World::ProcessMessages (this=0x1654280)

at /home/deadmanlogan/i_am_from_source/Gazebo-7/gazebo/physics/World.cc:2282

15 0x00007ffff5c0069f in gazebo::physics::World::Step (this=0x1654280) at /home/deadmanlogan/i_am_from_source/Gazebo-7/gazebo/physics/World.cc:688

16 0x00007ffff5bff06c in gazebo::physics::World::RunLoop (this=0x1654280) at /home/deadmanlogan/i_am_from_source/Gazebo-7/gazebo/physics/World.cc:481

17 0x00007ffff5c2e413 in boost::_mfi::mf0<void, gazebo::physics::world="">::operator() (this=0x12ac178, p=0x1654280)

at /usr/include/boost/bind/mem_fn_template.hpp:49

18 0x00007ffff5c2d4be in boost::_bi::list1<boost::_bi::value<gazebo::physics::world*> >::operator()<boost::_mfi::mf0<void, gazebo::physics::world="">, boost::_bi::list0> (this=0x12ac188, f=..., a=...) at /usr/include/boost/bind/bind.hpp:253

19 0x00007ffff5c2b74a in boost::_bi::bind_t<void, boost::_mfi::mf0<void,="" gazebo::physics::world="">, boost::_bi::list1<boost::_bi::value<gazebo::physics::world*> > >::operator() (this=0x12ac178) at /usr/include/boost/bind/bind.hpp:893

20 0x00007ffff5c3070a in boost::detail::thread_data<boost::_bi::bind_t<void, boost::_mfi::mf0<void,="" gazebo::physics::world="">, boost::_bi::list1<boost::_bi::value<gazebo::physics::world*> > > >::run (this=0x12abfc0) at /usr/include/boost/thread/detail/thread.hpp:116

21 0x00007ffff35c65d5 in ?? () from /usr/lib/x86_64-linux-gnu/libboost_thread.so.1.58.0

22 0x00007ffff79086ba in start_thread (arg=0x7fff63ffd700) at pthread_create.c:333

23 0x00007ffff64c741d in clone () at ../sysdeps/unix/sysv/linux/x86_64/clone.S:109**

Segmentation fault on spawning pr2 with its controllers using pr2_controller_manager

I am using gazebo 7 with ros-kinetic on ubuntu xenial .I am trying to spawn pr2 urdf xacro model in gazebo along with its controllers using pr2_controller_manager. I am facing segmentation fault at :-

Thread 28 "gzserver" received signal SIGSEGV, Segmentation fault. [Switching to Thread 0x7fff63ffd700 (LWP 17825)] 0x00007fffc96ac0ed in ros::NodeHandle::destruct() () from /opt/ros/kinetic/lib/libroscpp.so

And it's backtrace is

** #0 0x00007fffc96ac0ed in ros::NodeHandle::destruct() () from /opt/ros/kinetic/lib/libroscpp.so

1 0x00007fffc96ac269 in ros::NodeHandle::~NodeHandle() () from /opt/ros/kinetic/lib/libroscpp.so

2 0x00007fff184b44b4 in pr2_controller_manager::ControllerManager::~ControllerManager() ()

from /home/deadmanlogan/i_am_from_source/catkin_ws/devel_isolated/pr2_controller_manager/lib/libpr2_controller_manager.so

3 0x00007fff184b4ed9 in pr2_controller_manager::ControllerManager::~ControllerManager() ()

from /home/deadmanlogan/i_am_from_source/catkin_ws/devel_isolated/pr2_controller_manager/lib/libpr2_controller_manager.so

4 0x00007fff105a580a in gazebo::GazeboRosControllerManager::~GazeboRosControllerManager() ()

from /home/deadmanlogan/i_am_from_source/catkin_ws/devel_isolated/pr2_gazebo_plugins/lib/libgazebo_ros_controller_manager.so

5 0x00007fff105a5996 in gazebo::GazeboRosControllerManager::~GazeboRosControllerManager() ()

from /home/deadmanlogan/i_am_from_source/catkin_ws/devel_isolated/pr2_gazebo_plugins/lib/libgazebo_ros_controller_manager.so

6 0x00007ffff5ba80c9 in boost::checked_delete<gazebo::modelplugin> (x=0x7fff0d794610) at /usr/include/boost/core/checked_delete.hpp:34

7 0x00007ffff5baadd6 in boost::detail::sp_counted_impl_p<gazebo::modelplugin>::dispose (this=0x7fff0d793db0)

at /usr/include/boost/smart_ptr/detail/sp_counted_impl.hpp:78

8 0x00007ffff59b4efe in boost::detail::sp_counted_base::release (this=0x7fff0d793db0)

at /usr/include/boost/smart_ptr/detail/sp_counted_base_gcc_x86.hpp:146

9 0x00007ffff59b4f91 in boost::detail::shared_count::~shared_count (this=0x7fff63ffb3d8, __in_chrg=<optimized out="">)

at /usr/include/boost/smart_ptr/detail/shared_count.hpp:443

10 0x00007ffff5b9f086 in boost::shared_ptr<gazebo::modelplugin>::~shared_ptr (this=0x7fff63ffb3d0, __in_chrg=<optimized out="">)

at /usr/include/boost/smart_ptr/shared_ptr.hpp:323

11 0x00007ffff5b9a392 in gazebo::physics::Model::LoadPlugin (this=0x7fff3c1794c0, _sdf=std::shared_ptr (count 3, weak 5) 0x7fff368df950)

at /home/deadmanlogan/i_am_from_source/Gazebo-7/gazebo/physics/Model.cc:1002

12 0x00007ffff5b999e2 in gazebo::physics::Model::LoadPlugins (this=0x7fff3c1794c0)

---Type <return> to continue, or q <return> to quit--- at /home/deadmanlogan/i_am_from_source/Gazebo-7/gazebo/physics/Model.cc:915

13 0x00007ffff5c08bd9 in gazebo::physics::World::ProcessFactoryMsgs (this=0x1654280)

at /home/deadmanlogan/i_am_from_source/Gazebo-7/gazebo/physics/World.cc:1958

14 0x00007ffff5c0b9de in gazebo::physics::World::ProcessMessages (this=0x1654280)

at /home/deadmanlogan/i_am_from_source/Gazebo-7/gazebo/physics/World.cc:2282

15 0x00007ffff5c0069f in gazebo::physics::World::Step (this=0x1654280) at /home/deadmanlogan/i_am_from_source/Gazebo-7/gazebo/physics/World.cc:688

16 0x00007ffff5bff06c in gazebo::physics::World::RunLoop (this=0x1654280) at /home/deadmanlogan/i_am_from_source/Gazebo-7/gazebo/physics/World.cc:481

17 0x00007ffff5c2e413 in boost::_mfi::mf0<void, gazebo::physics::world="">::operator() (this=0x12ac178, p=0x1654280)

at /usr/include/boost/bind/mem_fn_template.hpp:49

18 0x00007ffff5c2d4be in boost::_bi::list1<boost::_bi::value<gazebo::physics::world*> >::operator()<boost::_mfi::mf0<void, gazebo::physics::world="">, boost::_bi::list0> (this=0x12ac188, f=..., a=...) at /usr/include/boost/bind/bind.hpp:253

19 0x00007ffff5c2b74a in boost::_bi::bind_t<void, boost::_mfi::mf0<void,="" gazebo::physics::world="">, boost::_bi::list1<boost::_bi::value<gazebo::physics::world*> > >::operator() (this=0x12ac178) at /usr/include/boost/bind/bind.hpp:893

20 0x00007ffff5c3070a in boost::detail::thread_data<boost::_bi::bind_t<void, boost::_mfi::mf0<void,="" gazebo::physics::world="">, boost::_bi::list1<boost::_bi::value<gazebo::physics::world*> > > >::run (this=0x12abfc0) at /usr/include/boost/thread/detail/thread.hpp:116

21 0x00007ffff35c65d5 in ?? () from /usr/lib/x86_64-linux-gnu/libboost_thread.so.1.58.0

22 0x00007ffff79086ba in start_thread (arg=0x7fff63ffd700) at pthread_create.c:333

23 0x00007ffff64c741d in clone () at ../sysdeps/unix/sysv/linux/x86_64/clone.S:109**

click to hide/show revision 3
None

Segmentation fault on spawning pr2 with its controllers using pr2_controller_manager

I am using gazebo 7 with ros-kinetic on ubuntu xenial .I am trying to spawn pr2 urdf xacro model in gazebo along with its controllers using pr2_controller_manager. I am facing segmentation fault at :-

Thread

**Thread 28 "gzserver" received signal SIGSEGV, Segmentation fault.
[Switching to Thread 0x7fff63ffd700 (LWP 17825)]
0x00007fffc96ac0ed in ros::NodeHandle::destruct() () from /opt/ros/kinetic/lib/libroscpp.so

/opt/ros/kinetic/lib/libroscpp.so**

And it's backtrace is

** #0  0x00007fffc96ac0ed in ros::NodeHandle::destruct() () from /opt/ros/kinetic/lib/libroscpp.so

1 /opt/ros/kinetic/lib/libroscpp.so #1 0x00007fffc96ac269 in ros::NodeHandle::~NodeHandle() () from /opt/ros/kinetic/lib/libroscpp.so

2 /opt/ros/kinetic/lib/libroscpp.so #2 0x00007fff184b44b4 in pr2_controller_manager::ControllerManager::~ControllerManager() ()

from /home/deadmanlogan/i_am_from_source/catkin_ws/devel_isolated/pr2_controller_manager/lib/libpr2_controller_manager.so

3 () from /home/deadmanlogan/i_am_from_source/catkin_ws/devel_isolated/pr2_controller_manager/lib/libpr2_controller_manager.so #3 0x00007fff184b4ed9 in pr2_controller_manager::ControllerManager::~ControllerManager() ()

from /home/deadmanlogan/i_am_from_source/catkin_ws/devel_isolated/pr2_controller_manager/lib/libpr2_controller_manager.so

4 () from /home/deadmanlogan/i_am_from_source/catkin_ws/devel_isolated/pr2_controller_manager/lib/libpr2_controller_manager.so #4 0x00007fff105a580a in gazebo::GazeboRosControllerManager::~GazeboRosControllerManager() ()

from /home/deadmanlogan/i_am_from_source/catkin_ws/devel_isolated/pr2_gazebo_plugins/lib/libgazebo_ros_controller_manager.so

5 () from /home/deadmanlogan/i_am_from_source/catkin_ws/devel_isolated/pr2_gazebo_plugins/lib/libgazebo_ros_controller_manager.so #5 0x00007fff105a5996 in gazebo::GazeboRosControllerManager::~GazeboRosControllerManager() ()

from /home/deadmanlogan/i_am_from_source/catkin_ws/devel_isolated/pr2_gazebo_plugins/lib/libgazebo_ros_controller_manager.so

6 () from /home/deadmanlogan/i_am_from_source/catkin_ws/devel_isolated/pr2_gazebo_plugins/lib/libgazebo_ros_controller_manager.so #6 0x00007ffff5ba80c9 in boost::checked_delete<gazebo::modelplugin> boost::checked_delete<gazebo::ModelPlugin> (x=0x7fff0d794610) at /usr/include/boost/core/checked_delete.hpp:34

7 /usr/include/boost/core/checked_delete.hpp:34 #7 0x00007ffff5baadd6 in boost::detail::sp_counted_impl_p<gazebo::modelplugin>::dispose (this=0x7fff0d793db0)

boost::detail::sp_counted_impl_p<gazebo::ModelPlugin>::dispose (this=0x7fff0d793db0)
    at /usr/include/boost/smart_ptr/detail/sp_counted_impl.hpp:78

8 #8 0x00007ffff59b4efe in boost::detail::sp_counted_base::release (this=0x7fff0d793db0)

(this=0x7fff0d793db0)
    at /usr/include/boost/smart_ptr/detail/sp_counted_base_gcc_x86.hpp:146

9 #9 0x00007ffff59b4f91 in boost::detail::shared_count::~shared_count (this=0x7fff63ffb3d8, __in_chrg=<optimized out="">)

out>)
    at /usr/include/boost/smart_ptr/detail/shared_count.hpp:443

10 #10 0x00007ffff5b9f086 in boost::shared_ptr<gazebo::modelplugin>::~shared_ptr boost::shared_ptr<gazebo::ModelPlugin>::~shared_ptr (this=0x7fff63ffb3d0, __in_chrg=<optimized out="">)

out>)
    at /usr/include/boost/smart_ptr/shared_ptr.hpp:323

11 #11 0x00007ffff5b9a392 in gazebo::physics::Model::LoadPlugin (this=0x7fff3c1794c0, _sdf=std::shared_ptr (count 3, weak 5) 0x7fff368df950)

0x7fff368df950)
    at /home/deadmanlogan/i_am_from_source/Gazebo-7/gazebo/physics/Model.cc:1002

12 #12 0x00007ffff5b999e2 in gazebo::physics::Model::LoadPlugins (this=0x7fff3c1794c0)

(this=0x7fff3c1794c0) ---Type <return> to continue, or q <return> to quit--- at /home/deadmanlogan/i_am_from_source/Gazebo-7/gazebo/physics/Model.cc:915

13 /home/deadmanlogan/i_am_from_source/Gazebo-7/gazebo/physics/Model.cc:915 #13 0x00007ffff5c08bd9 in gazebo::physics::World::ProcessFactoryMsgs (this=0x1654280)

(this=0x1654280)
    at /home/deadmanlogan/i_am_from_source/Gazebo-7/gazebo/physics/World.cc:1958

14 #14 0x00007ffff5c0b9de in gazebo::physics::World::ProcessMessages (this=0x1654280)

(this=0x1654280)
    at /home/deadmanlogan/i_am_from_source/Gazebo-7/gazebo/physics/World.cc:2282

15 #15 0x00007ffff5c0069f in gazebo::physics::World::Step (this=0x1654280) at /home/deadmanlogan/i_am_from_source/Gazebo-7/gazebo/physics/World.cc:688

16 /home/deadmanlogan/i_am_from_source/Gazebo-7/gazebo/physics/World.cc:688 #16 0x00007ffff5bff06c in gazebo::physics::World::RunLoop (this=0x1654280) at /home/deadmanlogan/i_am_from_source/Gazebo-7/gazebo/physics/World.cc:481

17 /home/deadmanlogan/i_am_from_source/Gazebo-7/gazebo/physics/World.cc:481 #17 0x00007ffff5c2e413 in boost::_mfi::mf0<void, gazebo::physics::world="">::operator() gazebo::physics::World>::operator() (this=0x12ac178, p=0x1654280)

p=0x1654280)
    at /usr/include/boost/bind/mem_fn_template.hpp:49

18 #18 0x00007ffff5c2d4be in boost::_bi::list1<boost::_bi::value<gazebo::physics::world*> boost::_bi::list1<boost::_bi::value<gazebo::physics::World*> >::operator()<boost::_mfi::mf0<void, gazebo::physics::world="">, gazebo::physics::World>, boost::_bi::list0> (this=0x12ac188, f=..., a=...) at /usr/include/boost/bind/bind.hpp:253

19 /usr/include/boost/bind/bind.hpp:253 #19 0x00007ffff5c2b74a in boost::_bi::bind_t<void, boost::_mfi::mf0<void,="" gazebo::physics::world="">, boost::_bi::list1<boost::_bi::value<gazebo::physics::world*> boost::_mfi::mf0<void, gazebo::physics::World>, boost::_bi::list1<boost::_bi::value<gazebo::physics::World*> > >::operator() (this=0x12ac178) at /usr/include/boost/bind/bind.hpp:893

20 /usr/include/boost/bind/bind.hpp:893 #20 0x00007ffff5c3070a in boost::detail::thread_data<boost::_bi::bind_t<void, boost::_mfi::mf0<void,="" gazebo::physics::world="">, boost::_bi::list1<boost::_bi::value<gazebo::physics::world*> boost::_mfi::mf0<void, gazebo::physics::World>, boost::_bi::list1<boost::_bi::value<gazebo::physics::World*> > > >::run (this=0x12abfc0) at /usr/include/boost/thread/detail/thread.hpp:116

21 /usr/include/boost/thread/detail/thread.hpp:116 #21 0x00007ffff35c65d5 in ?? () from /usr/lib/x86_64-linux-gnu/libboost_thread.so.1.58.0

22 /usr/lib/x86_64-linux-gnu/libboost_thread.so.1.58.0 #22 0x00007ffff79086ba in start_thread (arg=0x7fff63ffd700) at pthread_create.c:333

23 pthread_create.c:333 #23 0x00007ffff64c741d in clone () at ../sysdeps/unix/sysv/linux/x86_64/clone.S:109**

../sysdeps/unix/sysv/linux/x86_64/clone.S:109**