sick_generic_monitoring.cpp
Go to the documentation of this file.
1 /*
2  * Copyright (C) 2018, Ing.-Buero Dr. Michael Lehning, Hildesheim
3  * Copyright (C) 2018, SICK AG, Waldkirch
4  * All rights reserved.
5  *
6 * Licensed under the Apache License, Version 2.0 (the "License");
7 * you may not use this file except in compliance with the License.
8 * You may obtain a copy of the License at
9 *
10 * http://www.apache.org/licenses/LICENSE-2.0
11 *
12 * Unless required by applicable law or agreed to in writing, software
13 * distributed under the License is distributed on an "AS IS" BASIS,
14 * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied.
15 * See the License for the specific language governing permissions and
16 * limitations under the License.
17 *
18 *
19 * All rights reserved.
20 *
21 * Redistribution and use in source and binary forms, with or without
22 * modification, are permitted provided that the following conditions are met:
23 *
24 * * Redistributions of source code must retain the above copyright
25 * notice, this list of conditions and the following disclaimer.
26 * * Redistributions in binary form must reproduce the above copyright
27 * notice, this list of conditions and the following disclaimer in the
28 * documentation and/or other materials provided with the distribution.
29 * * Neither the name of Osnabrueck University nor the names of its
30 * contributors may be used to endorse or promote products derived from
31 * this software without specific prior written permission.
32 * * Neither the name of SICK AG nor the names of its
33 * contributors may be used to endorse or promote products derived from
34 * this software without specific prior written permission
35 * * Neither the name of Ing.-Buero Dr. Michael Lehning nor the names of its
36 * contributors may be used to endorse or promote products derived from
37 * this software without specific prior written permission
38 *
39 * THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS "AS IS"
40 * AND ANY EXPRESS OR IMPLIED WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE
41 * IMPLIED WARRANTIES OF MERCHANTABILITY AND FITNESS FOR A PARTICULAR PURPOSE
42 * ARE DISCLAIMED. IN NO EVENT SHALL THE COPYRIGHT OWNER OR CONTRIBUTORS BE
43 * LIABLE FOR ANY DIRECT, INDIRECT, INCIDENTAL, SPECIAL, EXEMPLARY, OR
44 * CONSEQUENTIAL DAMAGES (INCLUDING, BUT NOT LIMITED TO, PROCUREMENT OF
45 * SUBSTITUTE GOODS OR SERVICES; LOSS OF USE, DATA, OR PROFITS; OR BUSINESS
46 * INTERRUPTION) HOWEVER CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN
47 * CONTRACT, STRICT LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE)
48 * ARISING IN ANY WAY OUT OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE
49 * POSSIBILITY OF SUCH DAMAGE.
50  *
51  * Created on: 28th May 2018
52  *
53  * Authors:
54  * Michael Lehning <michael.lehning@lehning.de>
55  *
56  */
57 
59 
62 {
63  m_read_timeout_millisec = read_timeout_millisec; // read timeout in milliseconds, messages are expected after max <read_timeout_millisec> delay (otherwise timeout and scanner re-init)
64  m_lastRunState = scanner_init; // runState of last check: scanner_init, scanner_run or scanner_finalize
65 }
66 
69 {
70 }
71 
72 /*
73 * @brief Monitors incoming scanner messages.
74 * In case of read timeouts, checkState returns ExitError, otherwise ExitSuccess.
75 */
77 {
78  if(m_lastRunState != runState) // wait for new messages after state change
79  {
80  m_lastRunState = runState;
81  return sick_scan_xd::ExitSuccess; // OK
82  }
83  // if(scanner->numberOfDatagramInInputFifo() > 0) // still pending messages in receive queue
84  // {
85  // return sick_scan_xd::ExitSuccess; // OK
86  // }
87 
88  if(runState == scanner_run)
89  {
90  double read_timeout = 0.001 * scanner->getReadTimeOutInMs(); // current read timeout in seconds
91  uint64_t nanosec_last_tcp_msg = scanner->getNanosecTimestampLastTcpMessageReceived(); // timestamp in nanoseconds of the last received tcp message (or 0 if no message received)
92  uint64_t nanosec_now = std::max<uint64_t>(nanosec_last_tcp_msg, rosNanosecTimestampNow()); // timestamp in nanoseconds now
93  // ROS_INFO_STREAM("SickScanMonitor::checkState(): runState=scanner_run, last_tcp_msg=" << (1.0e-9 * nanosec_last_tcp_msg) << " sec, scanner->numberOfDatagramInInputFifo()=" << scanner->numberOfDatagramInInputFifo());
94 
95  if(nanosec_last_tcp_msg == 0)
96  {
97  return sick_scan_xd::ExitSuccess; // OK, wait for first message
98  }
99 
100  // Set read timeout to configured value (if we're in state scanner_run)
101  scanner->setReadTimeOutInMs(m_read_timeout_millisec);
102 
103  // Check timeout
104  double dt = 1.0e-9 * (nanosec_now - nanosec_last_tcp_msg);
105  if (dt > read_timeout)
106  {
107  // read timeout
108  ROS_ERROR_STREAM("## ERROR SickScanMonitor::checkState(): read timeout after " << dt << " sec, timeout (" << read_timeout << " sec) exceeded." );
109  return sick_scan_xd::ExitError; // timeout error
110  }
111 
112  }
113  return sick_scan_xd::ExitSuccess; // OK
114 }
115 
116 /*
117 * @brief Monitors incoming scanner messages.
118 * In case of read timeouts, checkStateReinitOnError closes the tcp connection, re-initializes the scanner.
119 * Returns ExitSuccess (no timeout or successful re-init), or ExitError otherwise.
120 */
122 {
123  if (checkState(runState, scanner, parser, services) == sick_scan_xd::ExitSuccess)
124  {
125  return sick_scan_xd::ExitSuccess; // connection ok, messages have been received within configured timeout.
126  }
127  else // read timeout or tcp error
128  {
129  // TCP-reconnect and scanner-restart after timeout
130  ROS_ERROR("## ERROR in sick_scan_xd: restarting scanner after read timeout");
131  try
132  {
133  while (rosOk() && scanner->reinit(nh, m_read_timeout_millisec) != sick_scan_xd::ExitSuccess)
134  {
135  ROS_ERROR("## ERROR in sick_scan_xd: reinit scanner failed, retrying ..");
136  }
137  ROS_INFO("sick_scan_xd: scanner successfully reinitialized after timeout");
139  }
140  catch(const std::exception& e)
141  {
142  ROS_ERROR_STREAM("## ERROR in SickScanMonitor::checkStateReinitOnError: exception " << e.what());
143  }
144  catch(...)
145  {
146  ROS_ERROR_STREAM("## ERROR in SickScanMonitor::checkStateReinitOnError: unknown exception ");
147  }
148  }
150 }
151 
154 : m_monitoring_thread(0), m_monitoring_thread_running(false)
155 {
156 }
157 
160 {
161  stopPointCloudMonitoring();
162 }
163 
164 /*
165 * @brief Starts a thread to monitor point cloud messages.
166 * The ros node will be killed, if no point cloud is published within a given amount of time.
167 */
168 bool sick_scan_xd::PointCloudMonitor::startPointCloudMonitoring(rosNodePtr nh, int timeout_millisec, const std::string& ros_cloud_topic)
169 {
170  m_nh = nh;
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;
175  m_monitoring_thread = new std::thread(&sick_scan_xd::PointCloudMonitor::runMonitoringThreadCb, this);
176  return true;
177 #else
178  ROS_ERROR("## ERROR PointCloudMonitor supported on ROS only");
179  return false;
180 #endif
181 }
182 
183 /*
184  * @brief Stops the thread to monitor point cloud messages.
185  */
187 {
188  m_monitoring_thread_running = false;
189  if(m_monitoring_thread)
190  {
191  if (m_monitoring_thread->joinable())
192  m_monitoring_thread->join();
193  delete(m_monitoring_thread);
194  m_monitoring_thread = 0;
195  }
196 }
197 
200 {
201  // ROS_INFO_STREAM("PointCloudMonitor::messageCbPointCloud: new message after " << (1.0e-9 * rosNanosecTimestampNow() - 1.0e-9 * m_last_msg_timestamp_nanosec) << " seconds");
202  m_last_msg_timestamp_nanosec = rosNanosecTimestampNow();
203 }
204 
206 void sick_scan_xd::PointCloudMonitor::messageCbPointCloudROS2(const std::shared_ptr<ros_sensor_msgs::PointCloud2> msg)
207 {
208  messageCbPointCloud(*msg);
209 }
210 
211 /*
212  * @brief Thread callback, runs the point cloud monitoring.
213  * If no point cloud is published within the timeout (150 sec. by default),
214  * the process is killed (and the node is restarted by ros)
215  */
217 {
218  // Get process id
219 #ifdef _MSC_VER
220  DWORD pid = GetCurrentProcessId();
221 #else
222  pid_t pid = getpid();
223 #endif
224 
225  // Subscribe to point cloud topic
226  m_last_msg_timestamp_nanosec = rosNanosecTimestampNow();
227 #if defined __ROS_VERSION && __ROS_VERSION == 1
228  ros::Subscriber pointcloud_subscriber1, pointcloud_subscriber2;
229  pointcloud_subscriber1 = m_nh->subscribe(m_ros_cloud_topic, 1, &sick_scan_xd::PointCloudMonitor::messageCbPointCloud, this);
230  if(m_ros_cloud_topic[0] != '/')
231  pointcloud_subscriber2 = m_nh->subscribe(std::string("/") + m_ros_cloud_topic, 1, &sick_scan_xd::PointCloudMonitor::messageCbPointCloud, this);
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));
238  pointcloud_subscriber1 = m_nh->create_subscription<ros_sensor_msgs::PointCloud2>(m_ros_cloud_topic, qos, std::bind(&sick_scan_xd::PointCloudMonitor::messageCbPointCloudROS2, this, std::placeholders::_1));
239  if(m_ros_cloud_topic[0] != '/')
240  pointcloud_subscriber2 = m_nh->create_subscription<ros_sensor_msgs::PointCloud2>(std::string("/") + m_ros_cloud_topic,10,std::bind(&sick_scan_xd::PointCloudMonitor::messageCbPointCloudROS2, this, std::placeholders::_1));
241 #else
242  ROS_ERROR("## ERROR PointCloudMonitor supported on ROS only");
243  return;
244 #endif
245 
246  // Run monitoring
247  while(rosOk() && m_monitoring_thread_running)
248  {
249  uint64_t timestamp_now_nanosec = rosNanosecTimestampNow();
250  if(timestamp_now_nanosec/1000000 > m_last_msg_timestamp_nanosec/1000000 + m_timeout_millisec)
251  {
252  // Kill pid due to timeout
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;
255 #ifdef _MSC_VER
256  kill_cmd << "taskkill /F /PID " << pid;
257 #else
258  kill_cmd << "nohup sleep 1 ; kill -9 " << pid;
259 #endif
260  ROS_ERROR_STREAM("## ERROR PointCloudMonitor: killing process by command \"" << kill_cmd.str() << "\" for restart");
261  int ret = system(kill_cmd.str().c_str());
262  }
263  else
264  {
265  // ROS_INFO_STREAM("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");
266  }
267 
268  usleep(100000);
269  }
270  m_monitoring_thread_running = false;
271 }
imu_delay_tester.dt
dt
Definition: imu_delay_tester.py:192
sick_scan_xd::PointCloudMonitor::stopPointCloudMonitoring
void stopPointCloudMonitoring(void)
Definition: sick_generic_monitoring.cpp:186
msg
msg
sick_scan_xd::SickScanCommonTcp::reinit
int reinit(rosNodePtr nh, int delay_millisec)
Definition: sick_scan_common_tcp.cpp:240
sick_scan_xd::SickScanServices
Definition: sick_scan_services.h:76
sick_generic_monitoring.h
scanner_run
@ scanner_run
Definition: sick_generic_laser.h:14
sensor_msgs::PointCloud2
::sensor_msgs::PointCloud2_< std::allocator< void > > PointCloud2
Definition: PointCloud2.h:90
sick_scan_xd::SickScanMonitor::SickScanMonitor
SickScanMonitor(int read_timeout_millisec=READ_TIMEOUT_MILLISEC_DEFAULT)
Definition: sick_generic_monitoring.cpp:61
sick_scan_xd::SickScanCommon::getNanosecTimestampLastTcpMessageReceived
uint64_t getNanosecTimestampLastTcpMessageReceived(void)
Definition: sick_scan_common.h:365
sick_scan_xd::SickGenericParser
Definition: sick_generic_parser.h:239
sick_scan_xd::SickScanMonitor::m_lastRunState
NodeRunState m_lastRunState
Definition: sick_generic_monitoring.h:102
rosQoS
int rosQoS
Definition: sick_ros_wrapper.h:170
sick_scan_xd::PointCloudMonitor::messageCbPointCloudROS2
void messageCbPointCloudROS2(const std::shared_ptr< ros_sensor_msgs::PointCloud2 > msg)
Definition: sick_generic_monitoring.cpp:206
sick_scan_xd::SickScanMonitor::checkStateReinitOnError
sick_scan_xd::ExitCode checkStateReinitOnError(rosNodePtr nh, NodeRunState runState, SickScanCommonTcp *scanner, sick_scan_xd::SickGenericParser *parser, sick_scan_xd::SickScanServices *services)
Definition: sick_generic_monitoring.cpp:121
usleep
void usleep(__int64 usec)
Definition: usleep.c:3
ROS_INFO_STREAM
#define ROS_INFO_STREAM(...)
Definition: sick_scan_ros2_example.cpp:71
NodeRunState
NodeRunState
Definition: sick_generic_laser.h:12
imu_delay_tester.parser
parser
Definition: imu_delay_tester.py:116
sick_scan_xd::ExitSuccess
@ ExitSuccess
Definition: abstract_parser.h:46
scanner_init
@ scanner_init
Definition: sick_generic_laser.h:14
ros::NodeHandle
sick_scan_xd::SickScanCommon::getReadTimeOutInMs
int getReadTimeOutInMs()
get timeout in milliseconds
Definition: sick_scan_common.cpp:1473
sick_scan_xd::SickScanMonitor::m_read_timeout_millisec
int m_read_timeout_millisec
Definition: sick_generic_monitoring.h:101
ROS_INFO
#define ROS_INFO(...)
Definition: sick_scan_logging.h:117
sick_scan_xd::SickScanMonitor::~SickScanMonitor
~SickScanMonitor()
Definition: sick_generic_monitoring.cpp:68
sick_scan_xd::SickScanCommon::setReadTimeOutInMs
void setReadTimeOutInMs(int timeOutInMs)
set timeout in milliseconds
Definition: sick_scan_common.cpp:1463
ROS_ERROR
#define ROS_ERROR(...)
Definition: sick_scan_logging.h:127
sick_scan_xd::PointCloudMonitor::~PointCloudMonitor
~PointCloudMonitor()
Definition: sick_generic_monitoring.cpp:159
sick_scan_xd::SickScanCommonTcp
Definition: sick_scan_common_tcp.h:91
sick_scan_xd::PointCloudMonitor::runMonitoringThreadCb
void runMonitoringThreadCb(void)
Definition: sick_generic_monitoring.cpp:216
sick_scan_xd::ExitCode
ExitCode
Definition: abstract_parser.h:44
pid
pid_t pid
Definition: sick_scan_test.cpp:321
rosNanosecTimestampNow
uint64_t rosNanosecTimestampNow(void)
Definition: sick_ros_wrapper.h:178
sick_scan_xd::PointCloudMonitor::startPointCloudMonitoring
bool startPointCloudMonitoring(rosNodePtr nh, int timeout_millisec=READ_TIMEOUT_MILLISEC_KILL_NODE, const std::string &ros_cloud_topic="cloud")
Definition: sick_generic_monitoring.cpp:168
ROS_ERROR_STREAM
#define ROS_ERROR_STREAM(...)
Definition: sick_scan_ros2_example.cpp:72
sick_scan_xd::SickScanMonitor::checkState
sick_scan_xd::ExitCode checkState(NodeRunState runState, SickScanCommonTcp *scanner, sick_scan_xd::SickGenericParser *parser, sick_scan_xd::SickScanServices *services)
Definition: sick_generic_monitoring.cpp:76
sick_scan_xd::PointCloudMonitor::PointCloudMonitor
PointCloudMonitor()
Definition: sick_generic_monitoring.cpp:153
sick_scan_xd::PointCloudMonitor::messageCbPointCloud
void messageCbPointCloud(const ros_sensor_msgs::PointCloud2 &msg)
Definition: sick_generic_monitoring.cpp:199
rosOk
bool rosOk(void)
Definition: sick_ros_wrapper.h:206
sick_scan_xd::ExitError
@ ExitError
Definition: abstract_parser.h:47
ros::Subscriber


sick_scan_xd
Author(s): Michael Lehning , Jochen Sprickerhof , Martin Günther
autogenerated on Fri Oct 25 2024 02:47:10