#include <four_wheel_steering.h>
|
| | FourWheelSteering () |
| |
| ros::Duration | getPeriod () const |
| |
| ros::Time | getTime () const |
| |
| void | read () |
| |
| bool | start_callback (std_srvs::Empty::Request &, std_srvs::Empty::Response &) |
| |
| bool | stop_callback (std_srvs::Empty::Request &, std_srvs::Empty::Response &) |
| |
| void | write () |
| |
| virtual bool | checkForConflict (const std::list< ControllerInfo > &info) const |
| |
| virtual bool | checkForConflict (const std::list< ControllerInfo > &info) const |
| |
| virtual void | doSwitch (const std::list< ControllerInfo > &, const std::list< ControllerInfo > &) |
| |
| virtual void | doSwitch (const std::list< ControllerInfo > &, const std::list< ControllerInfo > &) |
| |
| virtual bool | init (ros::NodeHandle &root_nh, ros::NodeHandle &robot_hw_nh) |
| |
| virtual bool | prepareSwitch (const std::list< ControllerInfo > &start_list, const std::list< ControllerInfo > &stop_list) |
| |
| virtual bool | prepareSwitch (const std::list< ControllerInfo > &start_list, const std::list< ControllerInfo > &stop_list) |
| |
| virtual void | read (const ros::Time &time, const ros::Duration &period) |
| |
| virtual void | read (const ros::Time &time, const ros::Duration &period) |
| |
| | RobotHW () |
| |
| virtual void | write (const ros::Time &time, const ros::Duration &period) |
| |
| virtual void | write (const ros::Time &time, const ros::Duration &period) |
| |
| virtual | ~RobotHW () |
| |
| T * | get () |
| |
| std::vector< std::string > | getInterfaceResources (std::string iface_type) const |
| |
| std::vector< std::string > | getNames () const |
| |
| void | registerInterface (T *iface) |
| |
| void | registerInterfaceManager (InterfaceManager *iface_man) |
| |
Definition at line 21 of file four_wheel_steering.h.
| FourWheelSteering::FourWheelSteering |
( |
| ) |
|
|
inline |
| ros::Time FourWheelSteering::getTime |
( |
| ) |
const |
|
inline |
| void FourWheelSteering::read |
( |
| ) |
|
|
inline |
| bool FourWheelSteering::start_callback |
( |
std_srvs::Empty::Request & |
, |
|
|
std_srvs::Empty::Response & |
|
|
) |
| |
|
inline |
| bool FourWheelSteering::stop_callback |
( |
std_srvs::Empty::Request & |
, |
|
|
std_srvs::Empty::Response & |
|
|
) |
| |
|
inline |
| void FourWheelSteering::write |
( |
| ) |
|
|
inline |
| bool FourWheelSteering::running_ |
|
private |
The documentation for this class was generated from the following file: