You signed in with another tab or window. Reload to refresh your session.You signed out in another tab or window. Reload to refresh your session.You switched accounts on another tab or window. Reload to refresh your session.Dismiss alert
TF starts having lots of warnings, e.g. in /opt/ros/jade/include/tf/LinearMath/Vector3.h
/opt/ros/jade/include/tf/LinearMath/Vector3.h:626:42: warning: cast from type ‘const tfScalar* {aka const double*}’ to type ‘unsigned char*’ casts away qualifiers [-Wcast-qual]
unsigned char* src = (unsigned char*) &sourceVal;
^
In file included from /opt/ros/jade/include/tf2/transform_storage.h:35:0,
from /opt/ros/jade/include/tf2/buffer_core.h:35,
from /opt/ros/jade/include/tf2_ros/buffer_interface.h:35,
from /opt/ros/jade/include/tf2_ros/buffer.h:35,
from /opt/ros/jade/include/tf/tf.h:48,
The text was updated successfully, but these errors were encountered:
This is doing byte ordering swapping for endianness. Its a valid warning in general but in this case it's actually correct. If you'd like to submit a PR to suppress the warnings that would be considered.
Adding to my random ROS package's CMake:
TF starts having lots of warnings, e.g. in
/opt/ros/jade/include/tf/LinearMath/Vector3.h
The text was updated successfully, but these errors were encountered: