Skip to content

Commit

Permalink
formatting
Browse files Browse the repository at this point in the history
  • Loading branch information
ARK3r committed Sep 21, 2023
1 parent de2d3c9 commit 5b8f573
Show file tree
Hide file tree
Showing 4 changed files with 10 additions and 14 deletions.
1 change: 0 additions & 1 deletion example_11/bringup/config/carlikebot_controllers.yaml
Original file line number Diff line number Diff line change
Expand Up @@ -29,4 +29,3 @@ ackermann_steering_controller:
rear_wheel_track: 0.2
front_wheels_radius: 0.05
rear_wheels_radius: 0.05

12 changes: 6 additions & 6 deletions example_11/bringup/launch/carlikebot.launch.py
Original file line number Diff line number Diff line change
Expand Up @@ -110,13 +110,13 @@ def generate_launch_description():
on_exit=[robot_ackermann_controller_spawner],
)
)
# the steering controller libraries by default publish odometry on a seperate topic than /tf

# the steering controller libraries by default publish odometry on a separate topic than /tf
relay_topic_to_tf_node = Node(
package='topic_tools',
executable='relay',
arguments=['/ackermann_steering_controller/tf_odometry', '/tf'],
output='screen',
package="topic_tools",
executable="relay",
arguments=["/ackermann_steering_controller/tf_odometry", "/tf"],
output="screen",
)

nodes = [
Expand Down
10 changes: 4 additions & 6 deletions example_11/hardware/carlikebot_system.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -55,9 +55,8 @@ hardware_interface::CallbackReturn CarlikeBotSystemHardware::on_init(
if (joint_is_steering)
{
RCLCPP_INFO(
rclcpp::get_logger("CarlikeBotSystemHardware"),
"Joint '%s' is a steering joint.", joint.name.c_str()
);
rclcpp::get_logger("CarlikeBotSystemHardware"), "Joint '%s' is a steering joint.",
joint.name.c_str());

if (joint.command_interfaces.size() != 1)
{
Expand Down Expand Up @@ -98,9 +97,8 @@ hardware_interface::CallbackReturn CarlikeBotSystemHardware::on_init(
else
{
RCLCPP_INFO(
rclcpp::get_logger("CarlikeBotSystemHardware"),
"Joint '%s' is a drive joint.", joint.name.c_str()
);
rclcpp::get_logger("CarlikeBotSystemHardware"), "Joint '%s' is a drive joint.",
joint.name.c_str());

// Drive joints have a velocity command interface and velocity and position state interface
if (joint.command_interfaces.size() != 1)
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -68,7 +68,6 @@ class CarlikeBotSystemHardware : public hardware_interface::SystemInterface
const rclcpp::Time & time, const rclcpp::Duration & period) override;

private:

// Parameters for the CarlikeBot simulation
double hw_start_sec_;
double hw_stop_sec_;
Expand Down

0 comments on commit 5b8f573

Please sign in to comment.