View_Creator_Dialog.h
Go to the documentation of this file.
1 
21 #ifndef VIEW_CREATOR_DIALOG_H_
22 #define VIEW_CREATOR_DIALOG_H_
23 
25 #include <wx/wx.h>
26 #include <ros/ros.h>
27 #include <sensor_msgs/Image.h>
28 #include <HalconCpp.h>
29 #include "View_Params_Wrapper.h"
30 #include <boost/thread.hpp>
31 
36 {
37 
38 private:
39 
42 
45 
48 
50  HalconCpp::HImage fixedImage;
51 
54 
57 
60 
63 
66 
68  double score_sum;
69 
71  double feature_sum;
72 
74  double time_sum;
75 
77  wxTimer* update_timer;
78 
80  HalconCpp::HDescriptorModel desc_model;
81 
82 
83 
84 
85 
87  boost::thread paint_thread;
88 
91 
95  void onUpdate(wxTimerEvent& evt);
96 
102  void onModelCameraImage(const sensor_msgs::Image::ConstPtr& msg);
103 
110  void onTestCameraImage(const sensor_msgs::Image::ConstPtr& msg, bool use_file);
111 
117  void enableGuiElements(bool enable = true);
118 
124  void enableGuiElementsTest(bool enable = true);
125 
129  void updateImageOnCrop();
130 
136  void paint_test_image(HalconCpp::HImage img);
137 
138 
139 
140 
141 protected:
142 
146  void OnDialogClose(wxCloseEvent &event);
147  void onChoiceImageSource( wxCommandEvent& event );
148  void onChoiceImage( wxCommandEvent& event );
149  void onChoiceTestImageSource(wxCommandEvent &event);
150  void onChoiceTestImage( wxCommandEvent& event );
151  void onButtonCancelClicked( wxCommandEvent& event );
152  void onButtonSaveClicked( wxCommandEvent& event );
153  void onButtonStartTestClicked(wxCommandEvent &event);
154  void onButtonEndTestClicked(wxCommandEvent &event);
155  void onCheckUseCurrentImage(wxCommandEvent &event);
156 
157  void onEditTextUpperLeftRow(wxFocusEvent &event);
158  void onEditTextUpperLeftColumn(wxFocusEvent& event);
159  void onEditTextLowerRightRow(wxFocusEvent& event);
160  void onEditTextLowerRightColumn(wxFocusEvent& event);
161 
162  void onSlideUpperLeftRow(wxScrollEvent &event);
163  void onSlideUpperLeftColumn(wxScrollEvent &event);
164  void onSlideLowerRightRow(wxScrollEvent &event);
165  void onSlideLowerRightColumn(wxScrollEvent &event);
166 
167  void onEditTextUpperLeftRowEnter(wxCommandEvent &event);
168  void onEditTextUpperLeftColumnEnter(wxCommandEvent &event);
169  void onEditTextLowerRightRowEnter(wxCommandEvent &event);
170  void onEditTextLowerRightColumnEnter(wxCommandEvent &event);
171 
172  void onEditTextOrientationX(wxFocusEvent &event);
173  void onEditTextOrientationY(wxFocusEvent &event);
174  void onEditTextOrientationZ(wxFocusEvent &event);
175  void onEditTextScore(wxFocusEvent &event);
176  void onEditTextVerticalOffset(wxFocusEvent &event);
177  void onEditTextHorizontalOffset(wxFocusEvent &event);
178  void onEditTextDepth(wxFocusEvent &event);
179  void onEditTextFernNumber(wxFocusEvent &event);
180  void onEditTextPatchSize(wxFocusEvent &event);
181  void onEditTextMinScale(wxFocusEvent &event);
182  void onEditTextMaxScale(wxFocusEvent &event);
183 
184  void onEditTextOrientationXEnter(wxCommandEvent &event);
185  void onEditTextOrientationYEnter(wxCommandEvent &event);
186  void onEditTextOrientationZEnter(wxCommandEvent &event);
187  void onEditTextScoreEnter(wxCommandEvent &event);
188  void onEditTextVerticalOffsetEnter(wxCommandEvent &event);
189  void onEditTextHorizontalOffsetEnter(wxCommandEvent &event);
190  void onEditTextDepthEnter(wxCommandEvent &event);
191  void onEditTextFernNumberEnter(wxCommandEvent &event);
192  void onEditTextPatchSizeEnter(wxCommandEvent &event);
193  void onEditTextMinScaleEnter(wxCommandEvent &event);
194  void onEditTextMaxScaleEnter(wxCommandEvent &event);
195 
196  void onEditTextAxis1X(wxFocusEvent &event);
197  void onEditTextAxis1Y(wxFocusEvent &event);
198  void onEditTextAxis1Z(wxFocusEvent &event);
199  void onEditTextAxis1Angle(wxFocusEvent &event);
200  void onEditTextAxis2X(wxFocusEvent &event);
201  void onEditTextAxis2Y(wxFocusEvent &event);
202  void onEditTextAxis2Z(wxFocusEvent &event);
203  void onEditTextAxis2Angle(wxFocusEvent &event);
204 
205  void onEditTextAxis1XEnter(wxCommandEvent &event);
206  void onEditTextAxis1YEnter(wxCommandEvent &event);
207  void onEditTextAxis1ZEnter(wxCommandEvent &event);
208  void onEditTextAxis1AngleEnter(wxCommandEvent &event);
209  void onEditTextAxis2XEnter(wxCommandEvent &event);
210  void onEditTextAxis2YEnter(wxCommandEvent &event);
211  void onEditTextAxis2ZEnter(wxCommandEvent &event);
212  void onEditTextAxis2AngleEnter(wxCommandEvent &event);
213 
214  void onCheckUpsideDown(wxCommandEvent &event);
215  void onCheckUseColor(wxCommandEvent &event);
216 
217 
218 public:
225  ViewCreatorDialog(wxWindow* parent, ViewParamsWrapper* params);
226 };
227 
228 
229 #endif //DESC_MODELS_DIALOG_H_
230 
231 
232 
233 
void onEditTextOrientationZ(wxFocusEvent &event)
void onEditTextMaxScaleEnter(wxCommandEvent &event)
void onModelCameraImage(const sensor_msgs::Image::ConstPtr &msg)
The callback function for the image-topic-subscriber.
void enableGuiElementsTest(bool enable=true)
Enables/Disables all Gui-elements which are not used during testing.
void onEditTextAxis2AngleEnter(wxCommandEvent &event)
void onEditTextAxis1ZEnter(wxCommandEvent &event)
void onEditTextScoreEnter(wxCommandEvent &event)
void onEditTextAxis2YEnter(wxCommandEvent &event)
void onEditTextOrientationXEnter(wxCommandEvent &event)
void onEditTextOrientationYEnter(wxCommandEvent &event)
void onEditTextAxis1Angle(wxFocusEvent &event)
void onCheckUseColor(wxCommandEvent &event)
void onEditTextPatchSizeEnter(wxCommandEvent &event)
void onEditTextLowerRightRowEnter(wxCommandEvent &event)
void onButtonStartTestClicked(wxCommandEvent &event)
ros::NodeHandle nh
void onEditTextUpperLeftRow(wxFocusEvent &event)
void onEditTextVerticalOffset(wxFocusEvent &event)
void onSlideUpperLeftRow(wxScrollEvent &event)
void onChoiceImage(wxCommandEvent &event)
void onEditTextDepth(wxFocusEvent &event)
void onEditTextAxis2ZEnter(wxCommandEvent &event)
void onChoiceTestImage(wxCommandEvent &event)
void onEditTextScore(wxFocusEvent &event)
void onCheckUseCurrentImage(wxCommandEvent &event)
void onEditTextAxis2Z(wxFocusEvent &event)
void onEditTextHorizontalOffsetEnter(wxCommandEvent &event)
void onEditTextAxis1Y(wxFocusEvent &event)
HalconCpp::HDescriptorModel desc_model
void onUpdate(wxTimerEvent &evt)
The callback function for the update-timer.
HalconCpp::HImage fixedImage
void onEditTextUpperLeftColumnEnter(wxCommandEvent &event)
boost::thread paint_thread
void onEditTextHorizontalOffset(wxFocusEvent &event)
void onChoiceImageSource(wxCommandEvent &event)
void onTestCameraImage(const sensor_msgs::Image::ConstPtr &msg, bool use_file)
The callback function for the test-image-topic-subscriber.
void onEditTextLowerRightColumn(wxFocusEvent &event)
void OnDialogClose(wxCloseEvent &event)
void onEditTextAxis1AngleEnter(wxCommandEvent &event)
ViewParamsWrapper * params
void onEditTextPatchSize(wxFocusEvent &event)
void onEditTextAxis2Y(wxFocusEvent &event)
void onEditTextOrientationX(wxFocusEvent &event)
void enableGuiElements(bool enable=true)
Enables/Disables the Gui-elements used for setting the parameters.
void onCheckUpsideDown(wxCommandEvent &event)
ros::Subscriber image_model_sub
void onEditTextAxis1YEnter(wxCommandEvent &event)
void onEditTextMaxScale(wxFocusEvent &event)
void onEditTextLowerRightColumnEnter(wxCommandEvent &event)
void onEditTextFernNumber(wxFocusEvent &event)
void onButtonEndTestClicked(wxCommandEvent &event)
void onEditTextAxis1X(wxFocusEvent &event)
void onButtonSaveClicked(wxCommandEvent &event)
void onEditTextAxis1Z(wxFocusEvent &event)
void onEditTextMinScaleEnter(wxCommandEvent &event)
ros::Subscriber image_test_sub
void onEditTextDepthEnter(wxCommandEvent &event)
void onEditTextAxis2XEnter(wxCommandEvent &event)
void onEditTextOrientationZEnter(wxCommandEvent &event)
void onEditTextUpperLeftColumn(wxFocusEvent &event)
void onEditTextUpperLeftRowEnter(wxCommandEvent &event)
void onEditTextVerticalOffsetEnter(wxCommandEvent &event)
void onEditTextFernNumberEnter(wxCommandEvent &event)
void paint_test_image(HalconCpp::HImage img)
Shows the given image on the right image panel.
void updateImageOnCrop()
Updates the shown image (left panel) after it was cropped with the sliders.
void onEditTextOrientationY(wxFocusEvent &event)
void onEditTextAxis2X(wxFocusEvent &event)
void onButtonCancelClicked(wxCommandEvent &event)
ViewCreatorDialog(wxWindow *parent, ViewParamsWrapper *params)
The constructor of this class.
void onSlideLowerRightColumn(wxScrollEvent &event)
void onChoiceTestImageSource(wxCommandEvent &event)
void onSlideUpperLeftColumn(wxScrollEvent &event)
void onEditTextMinScale(wxFocusEvent &event)
void onEditTextAxis1XEnter(wxCommandEvent &event)
void onSlideLowerRightRow(wxScrollEvent &event)
void onEditTextLowerRightRow(wxFocusEvent &event)
void onEditTextAxis2Angle(wxFocusEvent &event)


asr_descriptor_surface_based_recognition
Author(s): Allgeyer Tobias, Hutmacher Robin, Meißner Pascal
autogenerated on Mon Dec 16 2019 03:31:15