#include <gazebo_ros_kurt.h>
Public Member Functions | |
GazeboRosKurt () | |
virtual void | Load (physics::ModelPtr _parent, sdf::ElementPtr _sdf) |
virtual void | UpdateChild () |
virtual | ~GazeboRosKurt () |
Private Member Functions | |
void | OnCmdVel (const geometry_msgs::TwistConstPtr &msg) |
void | spin () |
Private Attributes | |
ros::Subscriber | cmd_vel_sub_ |
std::string | cmd_vel_topic_name_ |
ros::Publisher | joint_state_pub_ |
std::string | joint_states_topic_name_ |
physics::JointPtr | joints_ [NUM_JOINTS] |
sensor_msgs::JointState | js_ |
common::Time | last_cmd_vel_time_ |
float | max_velocity_ |
maximum forward speed of Kurt [m/s] | |
physics::ModelPtr | my_parent_ |
physics::WorldPtr | my_world_ |
std::string | node_namespace_ |
float | odom_pose_ [3] |
ros::Publisher | odom_pub_ |
std::string | odom_topic_name_ |
float | odom_vel_ [3] |
common::Time | prev_update_time_ |
ros::NodeHandle * | rosnode_ |
boost::thread * | spinner_thread_ |
float | torque_ |
maximum torque applied to the wheels [Nm] | |
float | turning_adaptation_ |
Turning adaptation for odometry. | |
event::ConnectionPtr | updateConnection |
float | wheel_diam_ |
Diameter of the wheels. | |
float | wheel_sep_ |
Separation between the wheels. | |
float | wheel_speed_left_ |
float | wheel_speed_right_ |
Desired speeds of the wheels. | |
Static Private Attributes | |
static const double | CMD_VEL_TIMEOUT = 0.6 |
static const size_t | NUM_JOINTS = 6 |
Definition at line 17 of file gazebo_ros_kurt.h.
Definition at line 17 of file gazebo_ros_kurt.cpp.
GazeboRosKurt::~GazeboRosKurt | ( | ) | [virtual] |
Definition at line 29 of file gazebo_ros_kurt.cpp.
void GazeboRosKurt::Load | ( | physics::ModelPtr | _parent, |
sdf::ElementPtr | _sdf | ||
) | [virtual] |
Definition at line 37 of file gazebo_ros_kurt.cpp.
void GazeboRosKurt::OnCmdVel | ( | const geometry_msgs::TwistConstPtr & | msg | ) | [private] |
Definition at line 280 of file gazebo_ros_kurt.cpp.
void GazeboRosKurt::spin | ( | ) | [private] |
Definition at line 297 of file gazebo_ros_kurt.cpp.
void GazeboRosKurt::UpdateChild | ( | ) | [virtual] |
Definition at line 163 of file gazebo_ros_kurt.cpp.
Definition at line 37 of file gazebo_ros_kurt.h.
const double gazebo::GazeboRosKurt::CMD_VEL_TIMEOUT = 0.6 [static, private] |
Definition at line 28 of file gazebo_ros_kurt.h.
std::string gazebo::GazeboRosKurt::cmd_vel_topic_name_ [private] |
Definition at line 41 of file gazebo_ros_kurt.h.
Definition at line 35 of file gazebo_ros_kurt.h.
std::string gazebo::GazeboRosKurt::joint_states_topic_name_ [private] |
Definition at line 43 of file gazebo_ros_kurt.h.
physics::JointPtr gazebo::GazeboRosKurt::joints_[NUM_JOINTS] [private] |
Definition at line 67 of file gazebo_ros_kurt.h.
sensor_msgs::JointState gazebo::GazeboRosKurt::js_ [private] |
Definition at line 81 of file gazebo_ros_kurt.h.
common::Time gazebo::GazeboRosKurt::last_cmd_vel_time_ [private] |
Definition at line 73 of file gazebo_ros_kurt.h.
float gazebo::GazeboRosKurt::max_velocity_ [private] |
maximum forward speed of Kurt [m/s]
Definition at line 58 of file gazebo_ros_kurt.h.
physics::ModelPtr gazebo::GazeboRosKurt::my_parent_ [private] |
Definition at line 61 of file gazebo_ros_kurt.h.
physics::WorldPtr gazebo::GazeboRosKurt::my_world_ [private] |
Definition at line 60 of file gazebo_ros_kurt.h.
std::string gazebo::GazeboRosKurt::node_namespace_ [private] |
Definition at line 39 of file gazebo_ros_kurt.h.
const size_t gazebo::GazeboRosKurt::NUM_JOINTS = 6 [static, private] |
Definition at line 27 of file gazebo_ros_kurt.h.
float gazebo::GazeboRosKurt::odom_pose_[3] [private] |
Definition at line 78 of file gazebo_ros_kurt.h.
Definition at line 34 of file gazebo_ros_kurt.h.
std::string gazebo::GazeboRosKurt::odom_topic_name_ [private] |
Definition at line 42 of file gazebo_ros_kurt.h.
float gazebo::GazeboRosKurt::odom_vel_[3] [private] |
Definition at line 79 of file gazebo_ros_kurt.h.
common::Time gazebo::GazeboRosKurt::prev_update_time_ [private] |
Definition at line 70 of file gazebo_ros_kurt.h.
ros::NodeHandle* gazebo::GazeboRosKurt::rosnode_ [private] |
Definition at line 32 of file gazebo_ros_kurt.h.
boost::thread* gazebo::GazeboRosKurt::spinner_thread_ [private] |
Definition at line 84 of file gazebo_ros_kurt.h.
float gazebo::GazeboRosKurt::torque_ [private] |
maximum torque applied to the wheels [Nm]
Definition at line 55 of file gazebo_ros_kurt.h.
float gazebo::GazeboRosKurt::turning_adaptation_ [private] |
Turning adaptation for odometry.
Definition at line 52 of file gazebo_ros_kurt.h.
Definition at line 76 of file gazebo_ros_kurt.h.
float gazebo::GazeboRosKurt::wheel_diam_ [private] |
Diameter of the wheels.
Definition at line 49 of file gazebo_ros_kurt.h.
float gazebo::GazeboRosKurt::wheel_sep_ [private] |
Separation between the wheels.
Definition at line 46 of file gazebo_ros_kurt.h.
float gazebo::GazeboRosKurt::wheel_speed_left_ [private] |
Definition at line 65 of file gazebo_ros_kurt.h.
float gazebo::GazeboRosKurt::wheel_speed_right_ [private] |
Desired speeds of the wheels.
Definition at line 64 of file gazebo_ros_kurt.h.