#include <gazebo_ros_force.h>
Public Member Functions | |
GazeboRosForce () | |
Constructor. | |
virtual | ~GazeboRosForce () |
Destructor. | |
Protected Member Functions | |
void | Load (physics::ModelPtr _model, sdf::ElementPtr _sdf) |
Load the controller. | |
virtual void | UpdateChild () |
Update the controller. | |
Private Member Functions | |
void | QueueThread () |
void | UpdateObjectForce (const geometry_msgs::Wrench::ConstPtr &_msg) |
call back when a Wrench message is published | |
Private Attributes | |
boost::thread | callback_queue_thread_ |
physics::LinkPtr | link_ |
A pointer to the Link, where force is applied. | |
std::string | link_name_ |
boost::mutex | lock_ |
A mutex to lock access to fields that are used in ROS message callbacks. | |
ros::CallbackQueue | queue_ |
std::string | robot_namespace_ |
for setting ROS name space | |
ros::NodeHandle * | rosnode_ |
A pointer to the ROS node. A node will be instantiated if it does not exist. | |
ros::Subscriber | sub_ |
std::string | topic_name_ |
ROS Wrench topic name. | |
event::ConnectionPtr | update_connection_ |
physics::WorldPtr | world_ |
geometry_msgs::Wrench | wrench_msg_ |
Definition at line 78 of file gazebo_ros_force.h.
Constructor.
parent | The parent entity, must be a Model or a Sensor |
Definition at line 41 of file gazebo_ros_force.cpp.
gazebo::GazeboRosForce::~GazeboRosForce | ( | ) | [virtual] |
Destructor.
Definition at line 53 of file gazebo_ros_force.cpp.
void gazebo::GazeboRosForce::Load | ( | physics::ModelPtr | _model, |
sdf::ElementPtr | _sdf | ||
) | [protected] |
Load the controller.
node | XML config node |
Definition at line 68 of file gazebo_ros_force.cpp.
void gazebo::GazeboRosForce::QueueThread | ( | ) | [private] |
Definition at line 155 of file gazebo_ros_force.cpp.
void gazebo::GazeboRosForce::UpdateChild | ( | ) | [protected, virtual] |
Update the controller.
Definition at line 142 of file gazebo_ros_force.cpp.
void gazebo::GazeboRosForce::UpdateObjectForce | ( | const geometry_msgs::Wrench::ConstPtr & | _msg | ) | [private] |
call back when a Wrench message is published
Definition at line 130 of file gazebo_ros_force.cpp.
boost::thread gazebo::GazeboRosForce::callback_queue_thread_ [private] |
Definition at line 120 of file gazebo_ros_force.h.
physics::LinkPtr gazebo::GazeboRosForce::link_ [private] |
A pointer to the Link, where force is applied.
Definition at line 100 of file gazebo_ros_force.h.
std::string gazebo::GazeboRosForce::link_name_ [private] |
Definition at line 112 of file gazebo_ros_force.h.
boost::mutex gazebo::GazeboRosForce::lock_ [private] |
A mutex to lock access to fields that are used in ROS message callbacks.
Definition at line 107 of file gazebo_ros_force.h.
Definition at line 118 of file gazebo_ros_force.h.
std::string gazebo::GazeboRosForce::robot_namespace_ [private] |
for setting ROS name space
Definition at line 115 of file gazebo_ros_force.h.
ros::NodeHandle* gazebo::GazeboRosForce::rosnode_ [private] |
A pointer to the ROS node. A node will be instantiated if it does not exist.
Definition at line 103 of file gazebo_ros_force.h.
ros::Subscriber gazebo::GazeboRosForce::sub_ [private] |
Definition at line 104 of file gazebo_ros_force.h.
std::string gazebo::GazeboRosForce::topic_name_ [private] |
Definition at line 124 of file gazebo_ros_force.h.
physics::WorldPtr gazebo::GazeboRosForce::world_ [private] |
Definition at line 97 of file gazebo_ros_force.h.
geometry_msgs::Wrench gazebo::GazeboRosForce::wrench_msg_ [private] |
Definition at line 121 of file gazebo_ros_force.h.