Skip to content

Commit

Permalink
battery and gps
Browse files Browse the repository at this point in the history
  • Loading branch information
miferco97 committed Jun 24, 2024
1 parent 31e1b57 commit dd0b3ea
Show file tree
Hide file tree
Showing 2 changed files with 3 additions and 2 deletions.
4 changes: 3 additions & 1 deletion launch/mavros_launch.py
Original file line number Diff line number Diff line change
Expand Up @@ -75,7 +75,9 @@ def get_node(context, *args, **kwargs) -> list:
'respawn_mavros': LaunchConfiguration('respawn_mavros')},
pluginlists_yaml, config_yaml],
remappings=[('imu/data', f'/{namespace}/sensor_measurements/imu'),
('gps/fix', f'/{namespace}/sensor_measurements/gps_raw'),
('global_position/global', f'/{namespace}/sensor_measurements/gps'),
('battery', f'/{namespace}/sensor_measurements/battery'),

],
)]

Expand Down
1 change: 0 additions & 1 deletion src/mavlink_platform.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -79,7 +79,6 @@ MavlinkPlatform::MavlinkPlatform(const rclcpp::NodeOptions & options)

mavlink_odom_sub_ = this->create_subscription<nav_msgs::msg::Odometry>(
"mavros/local_position/odom", rclcpp::SensorDataQoS(),

[&](const nav_msgs::msg::Odometry::SharedPtr msg) {
msg->child_frame_id = base_link_frame_id_;
msg->header.frame_id = odom_frame_id_;
Expand Down

0 comments on commit dd0b3ea

Please sign in to comment.