Go to the documentation of this file.
41 #ifndef TRICYCLE_DRIVE_PLUGIN_HH
42 #define TRICYCLE_DRIVE_PLUGIN_HH
53 #include <geometry_msgs/Twist.h>
54 #include <geometry_msgs/Pose2D.h>
55 #include <nav_msgs/Odometry.h>
56 #include <nav_msgs/OccupancyGrid.h>
57 #include <sensor_msgs/JointState.h>
64 #include <boost/thread.hpp>
65 #include <boost/bind.hpp>
90 void Load(physics::ModelPtr _parent, sdf::ElementPtr _sdf);
102 void motorController(
double target_speed,
double target_angle,
double dt);
146 void cmdVelCallback(
const geometry_msgs::Twist::ConstPtr& cmd_msg);
double wheel_deceleration_
std::string robot_namespace_
physics::JointPtr joint_steering_
void publishOdometry(double step_time)
geometry_msgs::Pose2D pose_encoder_
ros::Subscriber cmd_vel_subscriber_
boost::thread callback_queue_thread_
double diameter_actuated_wheel_
event::ConnectionPtr update_connection_
double separation_encoder_wheel_
double wheel_acceleration_
virtual void UpdateChild()
void motorController(double target_speed, double target_angle, double dt)
void Load(physics::ModelPtr _parent, sdf::ElementPtr _sdf)
bool publishWheelJointState_
void UpdateOdometryEncoder()
updates the relative robot pose based on the wheel encoders
ros::CallbackQueue queue_
double wheel_speed_tolerance_
boost::shared_ptr< tf::TransformBroadcaster > transform_broadcaster_
common::Time last_actuator_update_
sensor_msgs::JointState joint_state_
std::string odometry_topic_
physics::JointPtr joint_wheel_encoder_left_
ros::Publisher odometry_publisher_
std::string command_topic_
~GazeboRosTricycleDrive()
physics::JointPtr joint_wheel_encoder_right_
void cmdVelCallback(const geometry_msgs::Twist::ConstPtr &cmd_msg)
std::string odometry_frame_
ros::Publisher joint_state_publisher_
physics::JointPtr joint_wheel_actuated_
double diameter_encoder_wheel_
common::Time last_odom_update_
std::string robot_base_frame_
double steering_angle_tolerance_
void publishWheelJointState()
publishes the wheel tf's
gazebo_plugins
Author(s): John Hsu
autogenerated on Thu Sep 5 2024 02:49:55