Code Complexity Report

Source file: /__w/ros-metrics-reporter/ros-metrics-reporter/ros_ws/src/example/geometry2/tf2_ros_py/tf2_ros/buffer_client.py
Function name Cyclomatic complexity (20) LOC (200) Token count Parameter count (6)
__init__ 1 20 74 5
lookup_transform 3 32 120 5
lookup_transform_full 1 29 97 7
can_transform 2 22 51 5
can_transform_full 2 28 63 7
__process_goal.unblock 1 3 12 1
__process_goal.unblock_by_timeout 4 11 81 0
__process_goal 4 18 129 2
__process_result 9 16 177 2
destroy 1 3 15 1
Source file: /__w/ros-metrics-reporter/ros-metrics-reporter/ros_ws/src/example/geometry2/tf2_ros_py/tf2_ros/buffer.py
Function name Cyclomatic complexity (20) LOC (200) Token count Parameter count (6)
__init__ 3 21 125 3
__get_frames 1 6 28 3
set_transform 1 3 30 3
set_transform_static 1 3 30 3
_call_new_data_callbacks 3 7 44 1
_remove_callback 1 3 30 3
lookup_transform 1 18 51 5
lookup_transform_async 1 16 42 4
lookup_transform_full 1 22 67 7
lookup_transform_full_async 1 20 58 6
can_transform 6 29 132 5
can_transform_full 6 35 148 7
wait_for_transform_async._on_new_data 3 6 38 0
wait_for_transform_async 2 22 78 4
wait_for_transform_full_async._on_new_data 3 6 42 0
wait_for_transform_full_async 2 26 90 6
Source file: /__w/ros-metrics-reporter/ros-metrics-reporter/ros_ws/src/example/geometry2/tf2_ros_py/tf2_ros/transform_broadcaster.py
Function name Cyclomatic complexity (20) LOC (200) Token count Parameter count (6)
__init__ 2 16 53 4
sendTransform 3 15 63 3
Source file: /__w/ros-metrics-reporter/ros-metrics-reporter/ros_ws/src/example/geometry2/tf2_ros_py/tf2_ros/transform_listener.py
Function name Cyclomatic complexity (20) LOC (200) Token count Parameter count (6)
__init__.run_func 1 4 31 0
__init__ 4 42 198 9
__del__ 3 5 41 1
unregister 1 6 28 1
callback 2 4 31 2
static_callback 2 4 31 2
Source file: /__w/ros-metrics-reporter/ros-metrics-reporter/ros_ws/src/example/geometry2/tf2_ros_py/tf2_ros/buffer_interface.py
Function name Cyclomatic complexity (20) LOC (200) Token count Parameter count (6)
__init__ 1 2 16 1
transform 2 27 87 4
transform_full 2 35 99 6
lookup_transform 1 19 32 5
lookup_transform_full 1 23 40 7
can_transform 1 19 32 5
can_transform_full 1 23 40 7
Stamped 1 7 33 3
__init__ 1 2 16 2
__init__ 1 2 12 1
print_me 1 2 13 1
add 1 6 32 5
get 2 8 47 2
add_from_msg 1 6 30 4
add_to_msg 1 6 30 4
add_convert 1 6 35 5
get_from_msg 2 8 45 2
get_to_msg 2 8 45 2
get_convert 2 8 50 3
convert 3 14 95 2
Source file: /__w/ros-metrics-reporter/ros-metrics-reporter/ros_ws/src/example/geometry2/tf2_ros_py/tf2_ros/__init__.py
Source file: /__w/ros-metrics-reporter/ros-metrics-reporter/ros_ws/src/example/geometry2/tf2_ros_py/tf2_ros/static_transform_broadcaster.py
Function name Cyclomatic complexity (20) LOC (200) Token count Parameter count (6)
__init__ 2 14 66 4
sendTransform 3 7 62 3
Source file: /__w/ros-metrics-reporter/ros-metrics-reporter/ros_ws/src/example/geometry2/tf2_ros_py/setup.py