Skip to content

Commit

Permalink
chore: fixed extra mispells found in ci/cd
Browse files Browse the repository at this point in the history
Signed-off-by: Kenzo Lobos-Tsunekawa <[email protected]>
  • Loading branch information
knzo25 committed Jan 19, 2024
1 parent 4ce9f7d commit b120273
Show file tree
Hide file tree
Showing 14 changed files with 18 additions and 34 deletions.
3 changes: 3 additions & 0 deletions .cspell.json
Original file line number Diff line number Diff line change
Expand Up @@ -10,6 +10,7 @@
"astype",
"auxiliar",
"axisd",
"beforementioned",
"calib",
"cmap",
"coeffs",
Expand Down Expand Up @@ -51,6 +52,8 @@
"neighbours",
"ncols",
"nrows",
"omiya",
"overfits",
"pandar",
"permutate",
"pixmap",
Expand Down
15 changes: 0 additions & 15 deletions common/tier4_calibration_views/CMakeLists.txt
Original file line number Diff line number Diff line change
Expand Up @@ -5,30 +5,15 @@ find_package(ament_cmake REQUIRED)
find_package(ament_cmake_python REQUIRED)
find_package(rclpy REQUIRED)
find_package(autoware_cmake REQUIRED)
#find_package(sensor_msgs REQUIRED)
#find_package(nav_msgs REQUIRED)
#find_package(geometry_msgs REQUIRED)

autoware_package()
ament_python_install_package(${PROJECT_NAME})

#if(BUILD_TESTING)
# find_package(rclpy REQUIRED)
# find_package(ament_cmake_nose REQUIRED)

# ament_add_nose_test(pointclouds test/test_pointclouds.py)
# ament_add_nose_test(images test/test_images.py)
# ament_add_nose_test(occupancygrids test/test_occupancygrids.py)
# ament_add_nose_test(geometry test/test_geometry.py)
# ament_add_nose_test(quaternions test/test_quat.py)
#endif()

install(PROGRAMS
scripts/image_view_node.py
DESTINATION lib/${PROJECT_NAME}
)

##############
ament_export_dependencies(ament_cmake)
ament_export_dependencies(ament_cmake_python)
ament_package()
Original file line number Diff line number Diff line change
Expand Up @@ -484,8 +484,8 @@ def draw_pointcloud(self, painter):
),
)

# Transform (rescale) into the widet coordinate system
pointdloud_z = pointcloud_ccs[indexes, 2]
# Transform (rescale) into the widget coordinate system
pointcloud_z = pointcloud_ccs[indexes, 2]
pointcloud_i = self.data_renderer.pointcloud_intensity[indexes]

if self.data_renderer.marker_units == "meters":
Expand All @@ -494,10 +494,10 @@ def draw_pointcloud(self, painter):
* self.data_renderer.marker_size_meters
* self.width_image_to_widget_factor
)
scale_px = factor / pointdloud_z
scale_px = factor / pointcloud_z
else:
factor = self.data_renderer.marker_size_pixels * self.width_image_to_widget_factor
scale_px = factor * np.ones_like(pointdloud_z)
scale_px = factor * np.ones_like(pointcloud_z)

pointcloud_wcs = pointcloud_ics[indexes, :] * self.image_to_widget_factor

Expand All @@ -514,7 +514,7 @@ def draw_pointcloud(self, painter):
elif self.data_renderer.color_channel == "y":
color_scalars = pointcloud_ccs[indexes, 1][indexes2]
elif self.data_renderer.color_channel == "z":
color_scalars = pointdloud_z[indexes2]
color_scalars = pointcloud_z[indexes2]
elif self.data_renderer.color_channel == "intensity":
color_scalars = pointcloud_i[indexes2]
min_value = color_scalars.min()
Expand Down Expand Up @@ -598,7 +598,7 @@ def draw_calibration_points(self, painter):

repr_err = np.linalg.norm(object_points_ics - image_points, axis=1)

# Transform (rescale) into the widet coordinate system
# Transform (rescale) into the widget coordinate system
object_points_wcs = object_points_ics * self.image_to_widget_factor

radius = 10 * self.width_image_to_widget_factor
Expand Down Expand Up @@ -669,7 +669,7 @@ def draw_external_calibration_points(self, painter):
)
object_points_ics = object_points_ics.reshape(-1, 2)

# Transform (rescale) into the widet coordinate system
# Transform (rescale) into the widget coordinate system
object_points_wcs = object_points_ics * self.image_to_widget_factor

radius = 10 * self.width_image_to_widget_factor
Expand Down Expand Up @@ -776,7 +776,7 @@ def draw_current_point(self, painter):
)
object_point_ics = object_point_ics.reshape(1, 2)

# Transform (rescale) into the widet coordinate system
# Transform (rescale) into the widget coordinate system
object_point_wcs = object_point_ics * self.image_to_widget_factor
object_point_wcs = object_point_wcs.reshape(
2,
Expand Down
2 changes: 1 addition & 1 deletion sensor/docs/how_to_extrinsic_interactive.md
Original file line number Diff line number Diff line change
Expand Up @@ -97,7 +97,7 @@ Calibrating a camera-lidar pair (i.e., finding the extrinsics) makes the lidar p
The difference between a point in the image (p<sub>image</sub>), and the projection (p<sub>projected</sub>) in the image of its corresponding object point in lidar coordinates (p<sub>object</sub>) is denoted as the reprojection error and can be observed graphically in Figure 3.

<figure align="center">
<img src="images/camera-lidar/reprojerror.svg" width="500">
<img src="images/camera-lidar/reprojection_error.svg" width="500">
<figcaption align="center">Fig 3. Reprojection error</figcaption>
</figure>

Expand Down
2 changes: 1 addition & 1 deletion sensor/docs/how_to_extrinsic_tag_based.md
Original file line number Diff line number Diff line change
Expand Up @@ -131,7 +131,7 @@ Calibrating a camera-lidar pair (i.e., finding the extrinsics) makes the lidar p
The difference between a point in the image (p<sub>image</sub>), and the projection (p<sub>projected</sub>) in the image of its corresponding object point in lidar coordinates (p<sub>object</sub>) is denoted as the reprojection error and can be observed graphically in Figure 5.

<figure align="center">
<img src="images/camera-lidar/reprojerror.svg" width="500">
<img src="images/camera-lidar/reprojection_error.svg" width="500">
<figcaption align="center">Fig 5. Reprojection error</figcaption>
</figure>

Expand Down
1 change: 0 additions & 1 deletion sensor/interactive_camera_lidar_calibrator/package.xml
Original file line number Diff line number Diff line change
Expand Up @@ -10,7 +10,6 @@
<exec_depend>python3-matplotlib</exec_depend>
<exec_depend>python3-pyside2.qtquick</exec_depend>
<exec_depend>python3-transforms3d</exec_depend>
<exec_depend>ros2_numpy</exec_depend>
<exec_depend>ros2launch</exec_depend>
<exec_depend>tier4_calibration_msgs</exec_depend>
<exec_depend>tier4_calibration_views</exec_depend>
Expand Down
1 change: 1 addition & 0 deletions sensor/mapping_based_calibrator/CMakeLists.txt
Original file line number Diff line number Diff line change
Expand Up @@ -2,6 +2,7 @@
cmake_minimum_required(VERSION 3.5)
project(mapping_based_calibrator)

# cSpell:ignore DEIGEN
#set(CMAKE_CXX_FLAGS "${CMAKE_CXX_FLAGS} -O3 -DEIGEN_NO_DEBUG -march=native -Wl,--no-as-needed")
set(CMAKE_CXX_FLAGS "${CMAKE_CXX_FLAGS} -g")

Expand Down
1 change: 0 additions & 1 deletion sensor/mapping_based_calibrator/package.xml
Original file line number Diff line number Diff line change
Expand Up @@ -20,7 +20,6 @@
<depend>kalman_filter</depend>
<depend>libboost-filesystem</depend>
<depend>libboost-serialization</depend>
<depend>libg2o</depend>
<depend>libpcl-all-dev</depend>
<depend>nav_msgs</depend>
<depend>ndt_omp</depend>
Expand Down
2 changes: 1 addition & 1 deletion sensor/marker_radar_lidar_calibrator/rviz/default.rviz
Original file line number Diff line number Diff line change
Expand Up @@ -124,7 +124,7 @@ Visualization Manager:
Max Intensity: 4096
Min Color: 0; 0; 0
Min Intensity: 0
Name: lidar_forground_pointcloud
Name: lidar_foreground_pointcloud
Position Transformer: XYZ
Selectable: true
Size (Pixels): 3
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -8,7 +8,7 @@
<arg name="mapping_max_range" default="80.0" description="maximum distance to use for mapping"/>
<arg name="lidar_calibration_max_frames" default="3" description="Number of frames to use for calibration"/>
<arg name="solver_iterations" default="50" description="Number of iterations for the calibration solver"/>
<arg name="calibration_skip_keyframes" default="3" description="How many keyframes to skip at the beginnign when selecting calibration keyframes"/>
<arg name="calibration_skip_keyframes" default="3" description="How many keyframes to skip at the beginning when selecting calibration keyframes"/>
<arg name="rviz" default="true"/>

<let name="calibration_camera_optical_link_frames" value="['']"/>
Expand Down
2 changes: 1 addition & 1 deletion sensor/tag_based_pnp_calibrator/rviz/default_profile.rviz
Original file line number Diff line number Diff line change
Expand Up @@ -566,7 +566,7 @@ Visualization Manager:
Durability Policy: Volatile
History Policy: Keep Last
Reliability Policy: Reliable
Value: /lidartag/intesection_markers
Value: /lidartag/intersection_markers
Value: false
- Class: rviz_default_plugins/MarkerArray
Enabled: false
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -79,6 +79,6 @@
max_homography_error: 0.5
quad_decimate: 1.0
quad_sigma: 0.0
nthreads: 12
nthreads: 12 # cSpell:ignore nthreads
debug: false
refine_edges: true
3 changes: 0 additions & 3 deletions sensor/tag_based_sfm_calibrator/launch/calibrator.launch.xml
Original file line number Diff line number Diff line change
Expand Up @@ -151,10 +151,7 @@
<arg name="left_wheel_tag_id" default="22"/>
<arg name="right_wheel_tag_id" default="26"/>

<!-- these should not be commited -->
<let name="apriltag_detector_families" value="[16h5, 36h11]"/>
<!--let name="apriltag_detector_sizes" value="[0.6, 0.22]"/>
<let name="min_apriltag_filter_margin" value="30.0"/-->

<group>
<push-ros-namespace namespace="$(var ns)"/>
Expand Down

0 comments on commit b120273

Please sign in to comment.