Public Member Functions | Public Attributes | List of all members
ReactiveNav2DNode::MyReactiveInterface Struct Reference
Inheritance diagram for ReactiveNav2DNode::MyReactiveInterface:
Inheritance graph
[legend]

Public Member Functions

bool changeSpeeds (const mrpt::kinematics::CVehicleVelCmd &vel_cmd) override
 
bool getCurrentPoseAndSpeeds (mrpt::math::TPose2D &curPose, mrpt::math::TTwist2D &curVel, mrpt::system::TTimeStamp &timestamp, mrpt::math::TPose2D &curOdometry, std::string &frame_id) override
 
mrpt::kinematics::CVehicleVelCmd::Ptr getEmergencyStopCmd () override
 
mrpt::kinematics::CVehicleVelCmd::Ptr getStopCmd () override
 
 MyReactiveInterface (ReactiveNav2DNode &parent)
 
void sendNavigationEndDueToErrorEvent () override
 
void sendNavigationEndEvent () override
 
void sendNavigationStartEvent () override
 
void sendWaySeemsBlockedEvent () override
 
bool senseObstacles (CSimplePointsMap &obstacles, mrpt::system::TTimeStamp &timestamp) override
 
virtual bool startWatchdog (float T_ms) override
 
bool stop (bool isEmergency) override
 
virtual bool stopWatchdog () override
 

Public Attributes

ReactiveNav2DNodem_parent
 

Detailed Description

Definition at line 124 of file mrpt_reactivenav2d_node.cpp.

Constructor & Destructor Documentation

◆ MyReactiveInterface()

ReactiveNav2DNode::MyReactiveInterface::MyReactiveInterface ( ReactiveNav2DNode parent)
inline

Definition at line 128 of file mrpt_reactivenav2d_node.cpp.

Member Function Documentation

◆ changeSpeeds()

bool ReactiveNav2DNode::MyReactiveInterface::changeSpeeds ( const mrpt::kinematics::CVehicleVelCmd &  vel_cmd)
inlineoverride

Change the instantaneous speeds of robot.

Parameters
vLinear speed, in meters per second.
wAngular speed, in radians per second.
Returns
false on any error.

Definition at line 194 of file mrpt_reactivenav2d_node.cpp.

◆ getCurrentPoseAndSpeeds()

bool ReactiveNav2DNode::MyReactiveInterface::getCurrentPoseAndSpeeds ( mrpt::math::TPose2D &  curPose,
mrpt::math::TTwist2D &  curVel,
mrpt::system::TTimeStamp &  timestamp,
mrpt::math::TPose2D &  curOdometry,
std::string &  frame_id 
)
inlineoverride

Get the current pose and speeds of the robot.

Parameters
curPoseCurrent robot pose.
curVCurrent linear speed, in meters per second.
curWCurrent angular speed, in radians per second.
Returns
false on any error.

Definition at line 136 of file mrpt_reactivenav2d_node.cpp.

◆ getEmergencyStopCmd()

mrpt::kinematics::CVehicleVelCmd::Ptr ReactiveNav2DNode::MyReactiveInterface::getEmergencyStopCmd ( )
inlineoverride

Definition at line 243 of file mrpt_reactivenav2d_node.cpp.

◆ getStopCmd()

mrpt::kinematics::CVehicleVelCmd::Ptr ReactiveNav2DNode::MyReactiveInterface::getStopCmd ( )
inlineoverride

Definition at line 247 of file mrpt_reactivenav2d_node.cpp.

◆ sendNavigationEndDueToErrorEvent()

void ReactiveNav2DNode::MyReactiveInterface::sendNavigationEndDueToErrorEvent ( )
inlineoverride

Definition at line 258 of file mrpt_reactivenav2d_node.cpp.

◆ sendNavigationEndEvent()

void ReactiveNav2DNode::MyReactiveInterface::sendNavigationEndEvent ( )
inlineoverride

Definition at line 257 of file mrpt_reactivenav2d_node.cpp.

◆ sendNavigationStartEvent()

void ReactiveNav2DNode::MyReactiveInterface::sendNavigationStartEvent ( )
inlineoverride

Definition at line 256 of file mrpt_reactivenav2d_node.cpp.

◆ sendWaySeemsBlockedEvent()

void ReactiveNav2DNode::MyReactiveInterface::sendWaySeemsBlockedEvent ( )
inlineoverride

Definition at line 259 of file mrpt_reactivenav2d_node.cpp.

◆ senseObstacles()

bool ReactiveNav2DNode::MyReactiveInterface::senseObstacles ( CSimplePointsMap &  obstacles,
mrpt::system::TTimeStamp &  timestamp 
)
inlineoverride

Return the current set of obstacle points.

Returns
false on any error.

Definition at line 231 of file mrpt_reactivenav2d_node.cpp.

◆ startWatchdog()

virtual bool ReactiveNav2DNode::MyReactiveInterface::startWatchdog ( float  T_ms)
inlineoverridevirtual

Start the watchdog timer of the robot platform, if any.

Parameters
T_msPeriod, in ms.
Returns
false on any error.

Definition at line 225 of file mrpt_reactivenav2d_node.cpp.

◆ stop()

bool ReactiveNav2DNode::MyReactiveInterface::stop ( bool  isEmergency)
inlineoverride

Definition at line 214 of file mrpt_reactivenav2d_node.cpp.

◆ stopWatchdog()

virtual bool ReactiveNav2DNode::MyReactiveInterface::stopWatchdog ( )
inlineoverridevirtual

Stop the watchdog timer.

Returns
false on any error.

Definition at line 228 of file mrpt_reactivenav2d_node.cpp.

Member Data Documentation

◆ m_parent

ReactiveNav2DNode& ReactiveNav2DNode::MyReactiveInterface::m_parent

Definition at line 126 of file mrpt_reactivenav2d_node.cpp.


The documentation for this struct was generated from the following file:


mrpt_reactivenav2d
Author(s): Jose-Luis Blanco-Claraco
autogenerated on Tue Sep 17 2024 02:10:24