Skip to content

Commit

Permalink
ci(pre-commit): autofix
Browse files Browse the repository at this point in the history
  • Loading branch information
pre-commit-ci[bot] authored and KYabuuchi committed Jan 6, 2025
1 parent 5d760bd commit dfd6598
Show file tree
Hide file tree
Showing 3 changed files with 5 additions and 8 deletions.
2 changes: 1 addition & 1 deletion aip_xx1_gen2_launch/CMakeLists.txt
Original file line number Diff line number Diff line change
Expand Up @@ -18,4 +18,4 @@ ament_auto_package(INSTALL_TO_SHARE
install(PROGRAMS
scripts/septentrio_heading_converter.py
DESTINATION lib/${PROJECT_NAME}
)
)
4 changes: 1 addition & 3 deletions aip_xx1_gen2_launch/launch/lidar.launch.py
Original file line number Diff line number Diff line change
Expand Up @@ -105,9 +105,7 @@ def load_yaml(yaml_file_path):
base_parameters["enable_blockage_diag"] = LaunchConfiguration("enable_blockage_diag").perform(
context
)
base_parameters["return_mode"] = LaunchConfiguration("return_mode").perform(
context
)
base_parameters["return_mode"] = LaunchConfiguration("return_mode").perform(context)

sub_launch_actions = []
for launch in config["launches"]:
Expand Down
7 changes: 3 additions & 4 deletions aip_xx1_gen2_launch/scripts/septentrio_heading_converter.py
Original file line number Diff line number Diff line change
Expand Up @@ -13,16 +13,15 @@
# See the License for the specific language governing permissions and
# limitations under the License.

import rclpy
from rclpy.node import Node
from septentrio_gnss_driver.msg import AttEuler
from autoware_sensing_msgs.msg import GnssInsOrientationStamped
from geometry_msgs.msg import Quaternion
import numpy as np
import rclpy
from rclpy.node import Node
from septentrio_gnss_driver.msg import AttEuler


class OrientationConverter(Node):

def __init__(self):
super().__init__("septentrio_orientation_converter")
self.publisher = self.create_publisher(
Expand Down

0 comments on commit dfd6598

Please sign in to comment.