Skip to content

Commit

Permalink
Removed unused variable
Browse files Browse the repository at this point in the history
  • Loading branch information
haavarpb authored and vooon committed Oct 19, 2023
1 parent b5576dd commit 67caa4d
Showing 1 changed file with 0 additions and 1 deletion.
1 change: 0 additions & 1 deletion mavros_extras/src/plugins/guided_target.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -84,7 +84,6 @@ class GuidedTargetPlugin : public plugin::Plugin
rclcpp::Subscription<geographic_msgs::msg::GeoPointStamped>::SharedPtr gp_origin_sub;

Eigen::Vector3d current_gps; //!< geodetic coordinates LLA
Eigen::Vector3d current_local_pos; //!< Current local position in ENU

Eigen::Vector3d map_origin {}; //!< oigin of map frame [lla]
Eigen::Vector3d ecef_origin {}; //!< geocentric origin [m]
Expand Down

0 comments on commit 67caa4d

Please sign in to comment.