78 if(m_lastRunState != runState)
80 m_lastRunState = runState;
95 if(nanosec_last_tcp_msg == 0)
104 double dt = 1.0e-9 * (nanosec_now - nanosec_last_tcp_msg);
105 if (
dt > read_timeout)
108 ROS_ERROR_STREAM(
"## ERROR SickScanMonitor::checkState(): read timeout after " <<
dt <<
" sec, timeout (" << read_timeout <<
" sec) exceeded." );
130 ROS_ERROR(
"## ERROR in sick_scan_xd: restarting scanner after read timeout");
135 ROS_ERROR(
"## ERROR in sick_scan_xd: reinit scanner failed, retrying ..");
137 ROS_INFO(
"sick_scan_xd: scanner successfully reinitialized after timeout");
140 catch(
const std::exception& e)
142 ROS_ERROR_STREAM(
"## ERROR in SickScanMonitor::checkStateReinitOnError: exception " << e.what());
146 ROS_ERROR_STREAM(
"## ERROR in SickScanMonitor::checkStateReinitOnError: unknown exception ");
154 : m_monitoring_thread(0), m_monitoring_thread_running(false)
161 stopPointCloudMonitoring();
171 m_timeout_millisec = timeout_millisec;
172 m_ros_cloud_topic = ros_cloud_topic;
173 #if defined __ROS_VERSION && __ROS_VERSION > 0
174 m_monitoring_thread_running =
true;
178 ROS_ERROR(
"## ERROR PointCloudMonitor supported on ROS only");
188 m_monitoring_thread_running =
false;
189 if(m_monitoring_thread)
191 if (m_monitoring_thread->joinable())
192 m_monitoring_thread->join();
193 delete(m_monitoring_thread);
194 m_monitoring_thread = 0;
208 messageCbPointCloud(*
msg);
220 DWORD
pid = GetCurrentProcessId();
222 pid_t
pid = getpid();
227 #if defined __ROS_VERSION && __ROS_VERSION == 1
230 if(m_ros_cloud_topic[0] !=
'/')
232 #elif defined __ROS_VERSION && __ROS_VERSION == 2
233 rclcpp::Subscription<ros_sensor_msgs::PointCloud2>::SharedPtr pointcloud_subscriber1, pointcloud_subscriber2;
234 rosQoS qos = rclcpp::SystemDefaultsQoS();
235 overwriteByOptionalQOSconfig(m_nh, qos);
236 QoSConverter qos_converter;
237 ROS_INFO_STREAM(
"PointCloudMonitor: subscribing to topic " << m_ros_cloud_topic <<
", qos=" << qos_converter.convert(qos));
239 if(m_ros_cloud_topic[0] !=
'/')
242 ROS_ERROR(
"## ERROR PointCloudMonitor supported on ROS only");
247 while(
rosOk() && m_monitoring_thread_running)
250 if(timestamp_now_nanosec/1000000 > m_last_msg_timestamp_nanosec/1000000 + m_timeout_millisec)
253 ROS_ERROR_STREAM(
"## ERROR PointCloudMonitor: last point cloud message on topic \"" << m_ros_cloud_topic <<
"\" received " << (1.0e-9 * timestamp_now_nanosec - 1.0e-9 * m_last_msg_timestamp_nanosec) <<
" seconds ago, " << (1.0e-3 * m_timeout_millisec) <<
" seconds timeout exceeded.");
254 std::stringstream kill_cmd;
256 kill_cmd <<
"taskkill /F /PID " <<
pid;
258 kill_cmd <<
"nohup sleep 1 ; kill -9 " <<
pid;
260 ROS_ERROR_STREAM(
"## ERROR PointCloudMonitor: killing process by command \"" << kill_cmd.str() <<
"\" for restart");
261 int ret = system(kill_cmd.str().c_str());
270 m_monitoring_thread_running =
false;