#include <cob_lookat_driver.h>
Public Member Functions | |
CobLookatDriver () | |
void | command_vel_cb (const std_msgs::Float64MultiArray::ConstPtr &msg) |
bool | initialize () |
void | publish_state () |
void | run () |
void | update_state () |
~CobLookatDriver () | |
Public Attributes | |
ros::Subscriber | command_vel_sub_ |
std::vector< double > | current_pos_ |
std::vector< double > | current_vel_ |
unsigned int | dof_ |
std::vector< std::string > | joints_ |
ros::Publisher | jointstate_pub_ |
ros::Time | last_update_ |
ros::NodeHandle | nh_ |
double | update_rate_ |
Definition at line 36 of file cob_lookat_driver.h.
CobLookatDriver::CobLookatDriver | ( | ) | [inline] |
Definition at line 39 of file cob_lookat_driver.h.
void CobLookatDriver::command_vel_cb | ( | const std_msgs::Float64MultiArray::ConstPtr & | msg | ) |
ToDo: Do some checks!
Definition at line 98 of file cob_lookat_driver.cpp.
bool CobLookatDriver::initialize | ( | ) |
Definition at line 33 of file cob_lookat_driver.cpp.
void CobLookatDriver::publish_state | ( | ) |
Definition at line 83 of file cob_lookat_driver.cpp.
void CobLookatDriver::run | ( | ) |
Definition at line 60 of file cob_lookat_driver.cpp.
void CobLookatDriver::update_state | ( | ) |
Definition at line 73 of file cob_lookat_driver.cpp.
Definition at line 62 of file cob_lookat_driver.h.
std::vector<double> CobLookatDriver::current_pos_ |
Definition at line 59 of file cob_lookat_driver.h.
std::vector<double> CobLookatDriver::current_vel_ |
Definition at line 60 of file cob_lookat_driver.h.
unsigned int CobLookatDriver::dof_ |
Definition at line 56 of file cob_lookat_driver.h.
std::vector<std::string> CobLookatDriver::joints_ |
Definition at line 57 of file cob_lookat_driver.h.
Definition at line 63 of file cob_lookat_driver.h.
Definition at line 54 of file cob_lookat_driver.h.
Definition at line 50 of file cob_lookat_driver.h.
Definition at line 53 of file cob_lookat_driver.h.