Closed AndreasAntener closed 9 years ago
Looks like assert in boost internals. That bad sign because boost is a ton of complex code...
Interesting that error happen in imu_pub. You could blacklist it for verification (but some other plugins will be broken). Other possible source - you running out of memory.
It's hard to reproduce, but I blacklisted most of the plugins, including imu_pub and just got the error again:
[ INFO] [1447927217.524614960]: FCU URL: /dev/ttySAC0:921600
[ INFO] [1447927217.526272126]: serial0: device: /dev/ttySAC0 @ 921600 bps
[ INFO] [1447927217.528877960]: GCS URL: udp://:14555@:14550
[ INFO] [1447927217.530297460]: udp1: Bind address: 0.0.0.0:14555
[ INFO] [1447927217.550894251]: Plugin 3dr_radio blacklisted
[ INFO] [1447927217.551038501]: Plugin actuator_control blacklisted
[ INFO] [1447927217.551127710]: Plugin cam_imu_sync blacklisted
[ INFO] [1447927217.755198793]: Plugin command loaded and initialized
[ INFO] [1447927217.971945960]: udp1: Remote address: 192.168.43.175:14550
[ INFO] [1447927218.231698877]: Plugin distance_sensor loaded and initialized
[ INFO] [1447927218.232249710]: Plugin ftp blacklisted
[ INFO] [1447927218.290797877]: Plugin global_position loaded and initialized
[ INFO] [1447927218.291276793]: Plugin image_pub blacklisted
[ INFO] [1447927218.291403793]: Plugin imu_pub blacklisted
[ WARN] [1447927218.310095043]: GP: No GPS fix
[ INFO] [1447927218.321514085]: Plugin local_position loaded and initialized
[ INFO] [1447927218.321951627]: Plugin manual_control blacklisted
[ INFO] [1447927218.322087377]: Plugin mocap_pose_estimate blacklisted
[ INFO] [1447927218.338171793]: Plugin param loaded and initialized
[ INFO] [1447927218.338508668]: Plugin px4flow blacklisted
mavros_node: /usr/include/boost/smart_ptr/shared_ptr.hpp:653: typename boost::detail::sp_member_access<T>::type boost::shared_ptr<T>::operator->() const [with T = sensor_msgs::Imu_<std::allocator<void> >; typename boost::detail::sp_member_access<T>::type = sensor_msgs::Imu_<std::allocator<void> >*]: Assertion `px != 0' failed.
================================================================================REQUIRED process [mavros-2] has died!
process has died [pid 4054, exit code -6, cmd /home/px4/catkin_ws/devel/lib/mavros/mavros_node __name:=mavros __log:=/home/px4/.ros/log/54ecbe9a-8ea4-11e5-98f9-7062b89dbe3d/mavros-2.log].
log file: /home/px4/.ros/log/54ecbe9a-8ea4-11e5-98f9-7062b89dbe3d/mavros-2*.log
Initiating shutdown!
================================================================================
Any way I can enable more output to find the actual location of the error?
It actually happens every time now (since imu_pub is blacklisted), so it could be somewhere where imu data is used
Ok, the only other use I found is in local_position
, and if I blacklist that I don't get the error anymore. So we have a race condition here.
@vooon Since the update to 0.16.xx I sometimes get this error on launch:
Maybe every 1 out of 4 launches it happens. Do you have an idea what that could be?