Skip to content

Commit

Permalink
fix other packages
Browse files Browse the repository at this point in the history
Signed-off-by: Takayuki Murooka <[email protected]>
  • Loading branch information
takayuki5168 committed Jun 8, 2024
1 parent 2267336 commit 02c4a07
Show file tree
Hide file tree
Showing 2 changed files with 4 additions and 4 deletions.
Original file line number Diff line number Diff line change
Expand Up @@ -56,8 +56,8 @@
namespace accel_brake_map_calibrator
{

using autoware_raw_vehicle_cmd_converter::AccelMap;
using autoware_raw_vehicle_cmd_converter::BrakeMap;
using autoware::raw_vehicle_cmd_converter::AccelMap;
using autoware::raw_vehicle_cmd_converter::BrakeMap;
using autoware_vehicle_msgs::msg::SteeringReport;
using autoware_vehicle_msgs::msg::VelocityReport;
using geometry_msgs::msg::TwistStamped;
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -36,8 +36,8 @@ using GearCommand = autoware_vehicle_msgs::msg::GearCommand;
using Control = autoware_control_msgs::msg::Control;
using ExternalControlCommand = tier4_external_api_msgs::msg::ControlCommandStamped;
using Odometry = nav_msgs::msg::Odometry;
using autoware_raw_vehicle_cmd_converter::AccelMap;
using autoware_raw_vehicle_cmd_converter::BrakeMap;
using autoware::raw_vehicle_cmd_converter::AccelMap;
using autoware::raw_vehicle_cmd_converter::BrakeMap;
using Odometry = nav_msgs::msg::Odometry;

class ExternalCmdConverterNode : public rclcpp::Node
Expand Down

0 comments on commit 02c4a07

Please sign in to comment.