|
@@ -62,6 +62,10 @@
|
|
|
|
|
|
#include <string>
|
|
|
|
|
|
+#include "tier4_autoware_utils/geometry/geometry.hpp"
|
|
|
+#include "tier4_autoware_utils/ros/msg_covariance.hpp"
|
|
|
+#include "tier4_autoware_utils/ros/update_param.hpp"
|
|
|
+
|
|
|
|
|
|
using autoware_auto_control_msgs::msg::AckermannControlCommand;
|
|
|
using autoware_auto_geometry_msgs::msg::Complex32;
|
|
@@ -102,14 +106,22 @@ private:
|
|
|
|
|
|
rclcpp::Subscription<geometry_msgs::msg::PoseStamped>::SharedPtr pose_sub_;
|
|
|
|
|
|
- rclcpp::Publisher<geometry_msgs::msg::TwistStamped>::SharedPtr twist_pub_;
|
|
|
-
|
|
|
-
|
|
|
+ rclcpp::Publisher<VelocityReport>::SharedPtr pub_velocity_;
|
|
|
rclcpp::Publisher<Odometry>::SharedPtr pub_odom_;
|
|
|
- rclcpp::Publisher<tf2_msgs::msg::TFMessage>::SharedPtr pub_tf_;
|
|
|
+ rclcpp::Publisher<SteeringReport>::SharedPtr pub_steer_;
|
|
|
rclcpp::Publisher<AccelWithCovarianceStamped>::SharedPtr pub_acc_;
|
|
|
rclcpp::Publisher<Imu>::SharedPtr pub_imu_;
|
|
|
- rclcpp::Publisher<VelocityReport>::SharedPtr pub_velocity_;
|
|
|
+ rclcpp::Publisher<ControlModeReport>::SharedPtr pub_control_mode_report_;
|
|
|
+ rclcpp::Publisher<GearReport>::SharedPtr pub_gear_report_;
|
|
|
+ rclcpp::Publisher<TurnIndicatorsReport>::SharedPtr pub_turn_indicators_report_;
|
|
|
+ rclcpp::Publisher<HazardLightsReport>::SharedPtr pub_hazard_lights_report_;
|
|
|
+ rclcpp::Publisher<tf2_msgs::msg::TFMessage>::SharedPtr pub_tf_;
|
|
|
+ rclcpp::Publisher<PoseStamped>::SharedPtr pub_current_pose_;
|
|
|
+
|
|
|
+ rclcpp::Publisher<geometry_msgs::msg::TwistStamped>::SharedPtr twist_pub_;
|
|
|
+
|
|
|
+
|
|
|
+
|
|
|
|
|
|
rclcpp::TimerBase::SharedPtr mptimer;
|
|
|
|
|
@@ -122,6 +134,14 @@ private:
|
|
|
*/
|
|
|
void publish_velocity(const VelocityReport & velocity);
|
|
|
|
|
|
+ /**
|
|
|
+ * @brief publish steering
|
|
|
+ * @param [in] steer The steering to publish
|
|
|
+ */
|
|
|
+ void publish_steering(const SteeringReport & steer);
|
|
|
+
|
|
|
+ void publish_acceleration();
|
|
|
+
|
|
|
|
|
|
void CalcXY(double flon,double flat,double & fx,double & fy);
|
|
|
|
|
@@ -130,6 +150,8 @@ private:
|
|
|
std::string simulated_frame_id_; //!< @brief simulated vehicle frame id
|
|
|
std::string origin_frame_id_; //!< @brief map frame_id
|
|
|
|
|
|
+ SteeringReport current_steer_;
|
|
|
+
|
|
|
|
|
|
};
|
|
|
|