Go to the documentation of this file.
   25 #ifndef GAZEBO_ROS_PLANAR_MOVE_HH 
   26 #define GAZEBO_ROS_PLANAR_MOVE_HH 
   28 #include <boost/bind.hpp> 
   29 #include <boost/thread.hpp> 
   32 #include <gazebo/common/common.hh> 
   33 #include <gazebo/physics/physics.hh> 
   36 #include <geometry_msgs/Twist.h> 
   37 #include <nav_msgs/OccupancyGrid.h> 
   38 #include <nav_msgs/Odometry.h> 
   52       void Load(physics::ModelPtr parent, sdf::ElementPtr sdf);
 
   88       void cmdVelCallback(
const geometry_msgs::Twist::ConstPtr& cmd_msg);
 
  
boost::shared_ptr< ros::NodeHandle > rosnode_
void publishOdometry(double step_time)
ros::CallbackQueue queue_
boost::thread callback_queue_thread_
physics::ModelPtr parent_
virtual void UpdateChild()
void Load(physics::ModelPtr parent, sdf::ElementPtr sdf)
void cmdVelCallback(const geometry_msgs::Twist::ConstPtr &cmd_msg)
std::string odometry_frame_
event::ConnectionPtr update_connection_
std::string robot_base_frame_
common::Time last_odom_publish_time_
ros::Publisher odometry_pub_
std::string odometry_topic_
boost::shared_ptr< tf::TransformBroadcaster > transform_broadcaster_
std::string command_topic_
ignition::math::Pose3d last_odom_pose_
ros::Time last_cmd_received_time_
std::string robot_namespace_
gazebo_plugins
Author(s): John Hsu
autogenerated on Sun Mar 2 2025 03:49:12