sick_cloud_transform.cpp
Go to the documentation of this file.
1 /*
2 * Copyright (C) 2017, Ing.-Buero Dr. Michael Lehning, Hildesheim
3 * Copyright (C) 2017, 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: 12.08.2022
52  *
53  * Authors:
54  * Michael Lehning <michael.lehning@lehning.de>
55  *
56  */
57 #include <float.h>
60 
61 /*
62 * class SickCloudTransform applies an additional transform to the cartesian pointcloud, default: "0,0,0,0,0,0" (i.e. no transform)
63 * Note: add_transform_xyz_rpy is specified by 6D pose x,y,z,roll,pitch,yaw in [m] resp. [rad]
64 * It transforms a 3D point in cloud coordinates to 3D point in user defined world coordinates:
65 * add_transform_xyz_rpy := T[world,cloud] with parent "world" and child "cloud", i.e. P_world = T[world,cloud] * P_cloud
66 * The additional transform applies to cartesian lidar pointclouds and visualization marker (fields)
67 * It is NOT applied to polar pointclouds, radarscans, ldmrs objects or other messages
68 */
69 
71 {
72 }
73 
75 {
76  m_nh = nh;
77  std::string add_transform_xyz_rpy = "0,0,0,0,0,0";
78  rosDeclareParam(nh, "add_transform_xyz_rpy", add_transform_xyz_rpy);
79  rosGetParam(nh, "add_transform_xyz_rpy", add_transform_xyz_rpy);
80  bool add_transform_check_dynamic_updates = false;
81  rosDeclareParam(nh, "add_transform_check_dynamic_updates", add_transform_check_dynamic_updates);
82  rosGetParam(nh, "add_transform_check_dynamic_updates", add_transform_check_dynamic_updates);
83  if (!init(add_transform_xyz_rpy, cartesian_input_only, add_transform_check_dynamic_updates))
84  {
85  ROS_ERROR_STREAM("## ERROR SickCloudTransform(): Initialization by \"" << add_transform_xyz_rpy << "\" failed, use 6D pose \"x,y,z,roll,pitch,yaw\" in [m] resp. [rad]");
86  }
87 }
88 
89 sick_scan_xd::SickCloudTransform::SickCloudTransform(rosNodePtr nh, const std::string& add_transform_xyz_rpy, bool cartesian_input_only, bool add_transform_check_dynamic_updates)
90 {
91  m_nh = nh;
92  if (!init(add_transform_xyz_rpy, cartesian_input_only, add_transform_check_dynamic_updates))
93  {
94  ROS_ERROR_STREAM("## ERROR SickCloudTransform(): Initialization by \"" << add_transform_xyz_rpy << "\" failed, use 6D pose \"x,y,z,roll,pitch,yaw\" in [m] resp. [rad]");
95  }
96 }
97 
98 // Initializes rotation matrix and translation vector from a 6D pose configuration (x,y,z,roll,pitch,yaw) in [m] resp. [rad]
99 bool sick_scan_xd::SickCloudTransform::init(const std::string& add_transform_xyz_rpy, bool cartesian_input_only, bool add_transform_check_dynamic_updates)
100 {
101  // Split string add_transform_xyz_rpy to 6D pose x,y,z,roll,pitch,yaw in [m] resp. [rad]
102  std::vector<float> config_values = sick_scan_xd::parsePose(add_transform_xyz_rpy);
103  if(config_values.size() != 6)
104  {
105  ROS_ERROR_STREAM("## ERROR SickCloudTransform(): Can't parse config string \"" << add_transform_xyz_rpy << "\", use 6D pose \"x,y,z,roll,pitch,yaw\" in [m] resp. [rad]");
106  return false;
107  }
108  m_translation_vector[0] = config_values[0];
109  m_translation_vector[1] = config_values[1];
110  m_translation_vector[2] = config_values[2];
111  m_apply_3x3_rotation = false;
112  m_rotation_matrix = { 1, 0, 0, 0, 1, 0, 0, 0, 1 }; // 3x3 identity
113  m_azimuth_offset = 0;
114  if (cartesian_input_only)
115  {
116  if (fabs(config_values[3]) > FLT_EPSILON || fabs(config_values[4]) > FLT_EPSILON || fabs(config_values[5]) > FLT_EPSILON)
117  {
118  m_apply_3x3_rotation = true; // i.e. we have to apply the 3x3 rotation matrix to the cartesian pointclouds
119  m_rotation_matrix = eulerToRot3x3(config_values[3], config_values[4], config_values[5]);
120  }
121  }
122  else
123  {
124  if (fabs(config_values[3]) < FLT_EPSILON && fabs(config_values[4]) < FLT_EPSILON)
125  {
126  // roll == 0, pitch == 0, i.e. only yaw (rotation about z-axis) is configured. In this case an offset can be added to the lidar azimuth
127  // before conversion to cartesian pointcloud, which is faster than a 3x3 matrix multiplication.
128  m_apply_3x3_rotation = false; // roll == 0, pitch == 0, offset for azimuth is sufficient
129  m_rotation_matrix = { 1, 0, 0, 0, 1, 0, 0, 0, 1 }; // 3x3 identity
130  m_azimuth_offset = config_values[5]; // azimuth offset := yaw in [rad]
131  }
132  else
133  {
134  m_apply_3x3_rotation = true; // i.e. we have to apply the 3x3 rotation matrix to the cartesian pointclouds
135  m_rotation_matrix = eulerToRot3x3(config_values[3], config_values[4], config_values[5]);
136  m_azimuth_offset = 0;
137  }
138  }
139  // Initialization successful
140  m_add_transform_xyz_rpy = add_transform_xyz_rpy;
141  m_cartesian_input_only = cartesian_input_only;
142  m_add_transform_check_dynamic_updates = add_transform_check_dynamic_updates;
143  ROS_INFO_STREAM("SickCloudTransform: add_transform_xyz_rpy = (" << add_transform_xyz_rpy << ")");
144  ROS_INFO_STREAM("SickCloudTransform: azimuth_offset = " << (m_azimuth_offset * 180.0 / M_PI) << " [deg]");
145  ROS_INFO_STREAM("SickCloudTransform: additional 3x3 rotation matrix = { ("
146  << m_rotation_matrix[0][0] << "," << m_rotation_matrix[0][1] << "," << m_rotation_matrix[0][2] << "), ("
147  << m_rotation_matrix[1][0] << "," << m_rotation_matrix[1][1] << "," << m_rotation_matrix[1][2] << "), ("
148  << m_rotation_matrix[2][0] << "," << m_rotation_matrix[2][1] << "," << m_rotation_matrix[2][2] << ") }");
149  ROS_INFO_STREAM("SickCloudTransform: apply 3x3 rotation = " << (m_apply_3x3_rotation ? "true" : "false"));
150  ROS_INFO_STREAM("SickCloudTransform: additional translation = (" << m_translation_vector[0] << "," << m_translation_vector[1] << "," << m_translation_vector[2] << ")");
151  ROS_INFO_STREAM("SickCloudTransform: check_dynamic_updates = " << (m_add_transform_check_dynamic_updates ? "true" : "false"));
152  return true;
153 }
154 
155 // converts roll (rotation about X), pitch (rotation about Y), yaw (rotation about Z) to 3x3 rotation matrix
157 {
158  // roll: rotation about x axis
159  Matrix3x3 rot_x = {
160  1, 0, 0,
161  0, cosf(roll), -sinf(roll),
162  0, sinf(roll), cosf(roll)
163  };
164  // pitch: rotation about y axis
165  Matrix3x3 rot_y = {
166  cosf(pitch), 0, sinf(pitch),
167  0, 1, 0,
168  -sinf(pitch), 0, cosf(pitch)
169  };
170  // yaw: rotation about z axis
171  Matrix3x3 rot_z = {
172  cosf(yaw), -sinf(yaw), 0,
173  sinf(yaw), cosf(yaw), 0,
174  0, 0, 1
175  };
176  // 3x3 rotation matrix
177  Matrix3x3 rot_3x3 = multiply3x3(multiply3x3(rot_z, rot_y), rot_x); // rot_3x3 = rot_z * rot_y * rot_x
178  return rot_3x3;
179 }
180 
181 // Multiply two 3x3 matrices, return a * b
183 {
184  Matrix3x3 result3x3 = {
185 
186  a[0][0] * b[0][0] + a[0][1] * b[1][0] + a[0][2] * b[2][0],
187  a[0][0] * b[0][1] + a[0][1] * b[1][1] + a[0][2] * b[2][1],
188  a[0][0] * b[0][2] + a[0][1] * b[1][2] + a[0][2] * b[2][2],
189 
190  a[1][0] * b[0][0] + a[1][1] * b[1][0] + a[1][2] * b[2][0],
191  a[1][0] * b[0][1] + a[1][1] * b[1][1] + a[1][2] * b[2][1],
192  a[1][0] * b[0][2] + a[1][1] * b[1][2] + a[1][2] * b[2][2],
193 
194  a[2][0] * b[0][0] + a[2][1] * b[1][0] + a[2][2] * b[2][0],
195  a[2][0] * b[0][1] + a[2][1] * b[1][1] + a[2][2] * b[2][1],
196  a[2][0] * b[0][2] + a[2][1] * b[1][2] + a[2][2] * b[2][2]
197  };
198  return result3x3;
199 }
sick_cloud_transform.h
sick_scan_xd::SickCloudTransform::SickCloudTransform
SickCloudTransform()
Definition: sick_cloud_transform.cpp:70
roswrap::param::init
void init(const M_string &remappings)
Definition: param_modi.cpp:809
ROS_INFO_STREAM
#define ROS_INFO_STREAM(...)
Definition: sick_scan_ros2_example.cpp:71
sick_scan_xd::SickCloudTransform::Matrix3x3
std::array< std::array< float, 3 >, 3 > Matrix3x3
Definition: sick_cloud_transform.h:141
sick_scan_parse_util.h
sick_scan_xd::parsePose
std::vector< float > parsePose(const std::string &pose_xyz_rpy_str)
Definition: sick_scan_parse_util.cpp:100
ros::NodeHandle
rosGetParam
bool rosGetParam(rosNodePtr nh, const std::string &param_name, T &param_value)
Definition: sick_ros_wrapper.h:167
sick_scan_xd::SickCloudTransform::eulerToRot3x3
static Matrix3x3 eulerToRot3x3(float roll, float pitch, float yaw)
Definition: sick_cloud_transform.cpp:156
sick_scan_xd::SickCloudTransform::multiply3x3
static Matrix3x3 multiply3x3(const Matrix3x3 &a, const Matrix3x3 &b)
Definition: sick_cloud_transform.cpp:182
ROS_ERROR_STREAM
#define ROS_ERROR_STREAM(...)
Definition: sick_scan_ros2_example.cpp:72
rosDeclareParam
void rosDeclareParam(rosNodePtr nh, const std::string &param_name, const T &param_value)
Definition: sick_ros_wrapper.h:166
sick_scan_xd::SickCloudTransform::init
bool init(const std::string &add_transform_xyz_rpy, bool cartesian_input_only, bool add_transform_check_dynamic_updates)
Definition: sick_cloud_transform.cpp:99


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