Public Member Functions | Protected Slots | Protected Attributes | List of all members
ram_qt_guis::PoseInfo Class Reference

#include <pose_info.hpp>

Inheritance diagram for ram_qt_guis::PoseInfo:
Inheritance graph
[legend]

Public Member Functions

void checkForPublishers ()
 
void connectToServices ()
 
 PoseInfo (QWidget *parent=NULL)
 
void trajectoryCallback (const ram_msgs::AdditiveManufacturingTrajectoryConstPtr &)
 
virtual ~PoseInfo ()
 
- Public Member Functions inherited from rviz::Panel
virtual QString getClassId () const
 
virtual QString getDescription () const
 
virtual QString getName () const
 
void initialize (VisualizationManager *manager)
 
virtual void load (const Config &config)
 
virtual void onInitialize ()
 
 Panel (QWidget *parent=0)
 
virtual void save (Config config) const
 
virtual void setClassId (const QString &class_id)
 
virtual void setDescription (const QString &description)
 
virtual void setName (const QString &name)
 
virtual ~Panel ()
 

Protected Slots

void backButtonHandler ()
 
void firstPoseButtonHandler ()
 
void forwardButtonHandler ()
 
void getPoseInformation ()
 
void lastPoseButtonHandler ()
 
void load (const rviz::Config &config)
 
void save (rviz::Config config) const
 
void updateGUIparameters ()
 

Protected Attributes

QLabel * approach_type_
 
QPushButton * back_button_
 
QLabel * blend_radius_
 
QLabel * entry_pose_
 
QLabel * exit_pose_
 
QLabel * feed_rate_
 
QPushButton * first_pose_button_
 
QPushButton * forward_button_
 
ros::ServiceClient get_poses_from_trajectory_client_
 
QLabel * laser_power_
 
QPushButton * last_pose_button_
 
QLabel * layer_index_
 
QLabel * layers_level_
 
QLabel * movement_type_
 
ros::NodeHandle nh_
 
QLabel * p_
 
QLabel * polygon_end_
 
QLabel * polygon_start_
 
QSpinBox * pose_index_
 
ram_modify_trajectory::GetPosesFromTrajectory pose_params_
 
std::recursive_mutex pose_params_mutex_
 
QLabel * r_
 
QLabel * speed_
 
unsigned trajectory_size_
 
ros::Subscriber trajectory_sub_
 
QLabel * w_
 
QLabel * x_
 
QLabel * y_
 
QLabel * z_
 
- Protected Attributes inherited from rviz::Panel
VisualizationManagervis_manager_
 

Additional Inherited Members

- Signals inherited from rviz::Panel
void configChanged ()
 

Detailed Description

Definition at line 25 of file pose_info.hpp.

Constructor & Destructor Documentation

ram_qt_guis::PoseInfo::PoseInfo ( QWidget *  parent = NULL)

Definition at line 6 of file pose_info.cpp.

ram_qt_guis::PoseInfo::~PoseInfo ( )
virtual

Definition at line 133 of file pose_info.cpp.

Member Function Documentation

void ram_qt_guis::PoseInfo::backButtonHandler ( )
protectedslot

Definition at line 200 of file pose_info.cpp.

void ram_qt_guis::PoseInfo::checkForPublishers ( )

Definition at line 137 of file pose_info.cpp.

void ram_qt_guis::PoseInfo::connectToServices ( )

Definition at line 174 of file pose_info.cpp.

void ram_qt_guis::PoseInfo::firstPoseButtonHandler ( )
protectedslot

Definition at line 205 of file pose_info.cpp.

void ram_qt_guis::PoseInfo::forwardButtonHandler ( )
protectedslot

Definition at line 195 of file pose_info.cpp.

void ram_qt_guis::PoseInfo::getPoseInformation ( )
protectedslot

Definition at line 215 of file pose_info.cpp.

void ram_qt_guis::PoseInfo::lastPoseButtonHandler ( )
protectedslot

Definition at line 210 of file pose_info.cpp.

void ram_qt_guis::PoseInfo::load ( const rviz::Config config)
protectedslot

Definition at line 302 of file pose_info.cpp.

void ram_qt_guis::PoseInfo::save ( rviz::Config  config) const
protectedslot

Definition at line 313 of file pose_info.cpp.

void ram_qt_guis::PoseInfo::trajectoryCallback ( const ram_msgs::AdditiveManufacturingTrajectoryConstPtr &  msg)

Definition at line 157 of file pose_info.cpp.

void ram_qt_guis::PoseInfo::updateGUIparameters ( )
protectedslot

Definition at line 229 of file pose_info.cpp.

Member Data Documentation

QLabel* ram_qt_guis::PoseInfo::approach_type_
protected

Definition at line 68 of file pose_info.hpp.

QPushButton* ram_qt_guis::PoseInfo::back_button_
protected

Definition at line 75 of file pose_info.hpp.

QLabel* ram_qt_guis::PoseInfo::blend_radius_
protected

Definition at line 69 of file pose_info.hpp.

QLabel* ram_qt_guis::PoseInfo::entry_pose_
protected

Definition at line 63 of file pose_info.hpp.

QLabel* ram_qt_guis::PoseInfo::exit_pose_
protected

Definition at line 64 of file pose_info.hpp.

QLabel* ram_qt_guis::PoseInfo::feed_rate_
protected

Definition at line 72 of file pose_info.hpp.

QPushButton* ram_qt_guis::PoseInfo::first_pose_button_
protected

Definition at line 77 of file pose_info.hpp.

QPushButton* ram_qt_guis::PoseInfo::forward_button_
protected

Definition at line 76 of file pose_info.hpp.

ros::ServiceClient ram_qt_guis::PoseInfo::get_poses_from_trajectory_client_
protected

Definition at line 85 of file pose_info.hpp.

QLabel* ram_qt_guis::PoseInfo::laser_power_
protected

Definition at line 71 of file pose_info.hpp.

QPushButton* ram_qt_guis::PoseInfo::last_pose_button_
protected

Definition at line 78 of file pose_info.hpp.

QLabel* ram_qt_guis::PoseInfo::layer_index_
protected

Definition at line 60 of file pose_info.hpp.

QLabel* ram_qt_guis::PoseInfo::layers_level_
protected

Definition at line 59 of file pose_info.hpp.

QLabel* ram_qt_guis::PoseInfo::movement_type_
protected

Definition at line 67 of file pose_info.hpp.

ros::NodeHandle ram_qt_guis::PoseInfo::nh_
protected

Definition at line 84 of file pose_info.hpp.

QLabel* ram_qt_guis::PoseInfo::p_
protected

Definition at line 55 of file pose_info.hpp.

QLabel* ram_qt_guis::PoseInfo::polygon_end_
protected

Definition at line 62 of file pose_info.hpp.

QLabel* ram_qt_guis::PoseInfo::polygon_start_
protected

Definition at line 61 of file pose_info.hpp.

QSpinBox* ram_qt_guis::PoseInfo::pose_index_
protected

Definition at line 81 of file pose_info.hpp.

ram_modify_trajectory::GetPosesFromTrajectory ram_qt_guis::PoseInfo::pose_params_
protected

Definition at line 88 of file pose_info.hpp.

std::recursive_mutex ram_qt_guis::PoseInfo::pose_params_mutex_
protected

Definition at line 87 of file pose_info.hpp.

QLabel* ram_qt_guis::PoseInfo::r_
protected

Definition at line 56 of file pose_info.hpp.

QLabel* ram_qt_guis::PoseInfo::speed_
protected

Definition at line 70 of file pose_info.hpp.

unsigned ram_qt_guis::PoseInfo::trajectory_size_
protected

Definition at line 48 of file pose_info.hpp.

ros::Subscriber ram_qt_guis::PoseInfo::trajectory_sub_
protected

Definition at line 86 of file pose_info.hpp.

QLabel* ram_qt_guis::PoseInfo::w_
protected

Definition at line 54 of file pose_info.hpp.

QLabel* ram_qt_guis::PoseInfo::x_
protected

Definition at line 51 of file pose_info.hpp.

QLabel* ram_qt_guis::PoseInfo::y_
protected

Definition at line 52 of file pose_info.hpp.

QLabel* ram_qt_guis::PoseInfo::z_
protected

Definition at line 53 of file pose_info.hpp.


The documentation for this class was generated from the following files:


ram_qt_guis
Author(s): Victor Lamoine - Institut Maupertuis
autogenerated on Mon Jun 10 2019 14:50:11