在好例子网,分享、交流、成长!
您当前所在位置:首页C/C++ 开发实例嵌入式开发 → STM32通过rosserial接入ROS通讯开发

STM32通过rosserial接入ROS通讯开发

嵌入式开发

下载此实例
  • 开发语言:C/C++
  • 实例大小:71.25M
  • 下载次数:20
  • 浏览次数:149
  • 发布时间:2021-01-23
  • 实例类别:嵌入式开发
  • 发 布 人:良知犹存
  • 文件格式:.zip
  • 所需积分:2
 相关标签: serial STM32 STM3 OSS SSE

实例介绍

【实例简介】串口是一种设备间常用的通讯接口,rosserial将串口字符数据转发到标准ROS网络,并输出到rosout和其日志文件。本文将记录如何在ROS上使用其提供的serial包进行串口通信。
【实例截图】

【核心代码】

stm32_roslib

├── README.md
├── stm32f0_roslib_code
│   ├── Bsp
│   │   ├── config.h
│   │   ├── hardwareserial.cpp
│   │   ├── hardwareserial.h
│   │   ├── millisecondtimer.c
│   │   ├── millisecondtimer.h
│   │   ├── ring_buffer.h
│   │   ├── rosnode.cpp
│   │   ├── rosnode.h
│   │   └── rosnode.o
│   ├── Driver
│   │   ├── battery.cpp
│   │   ├── battery.h
│   │   ├── periph.c
│   │   ├── periph.h
│   │   ├── pid.c
│   │   ├── pid.h
│   │   ├── servo.cpp
│   │   ├── servo.h
│   │   ├── timer.c
│   │   ├── timer.h
│   │   ├── wheel.c
│   │   └── wheel.h
│   ├── Libs
│   │   ├── RosLibs
│   │   │   ├── Makefile
│   │   │   ├── STM32Hardware.h
│   │   │   ├── actionlib
│   │   │   │   ├── TestAction.h
│   │   │   │   ├── TestActionFeedback.h
│   │   │   │   ├── TestActionGoal.h
│   │   │   │   ├── TestActionResult.h
│   │   │   │   ├── TestFeedback.h
│   │   │   │   ├── TestGoal.h
│   │   │   │   ├── TestRequestAction.h
│   │   │   │   ├── TestRequestActionFeedback.h
│   │   │   │   ├── TestRequestActionGoal.h
│   │   │   │   ├── TestRequestActionResult.h
│   │   │   │   ├── TestRequestFeedback.h
│   │   │   │   ├── TestRequestGoal.h
│   │   │   │   ├── TestRequestResult.h
│   │   │   │   ├── TestResult.h
│   │   │   │   ├── TwoIntsAction.h
│   │   │   │   ├── TwoIntsActionFeedback.h
│   │   │   │   ├── TwoIntsActionGoal.h
│   │   │   │   ├── TwoIntsActionResult.h
│   │   │   │   ├── TwoIntsFeedback.h
│   │   │   │   ├── TwoIntsGoal.h
│   │   │   │   └── TwoIntsResult.h
│   │   │   ├── actionlib_msgs
│   │   │   │   ├── GoalID.h
│   │   │   │   ├── GoalStatus.h
│   │   │   │   └── GoalStatusArray.h
│   │   │   ├── actionlib_tutorials
│   │   │   │   ├── AveragingAction.h
│   │   │   │   ├── AveragingActionFeedback.h
│   │   │   │   ├── AveragingActionGoal.h
│   │   │   │   ├── AveragingActionResult.h
│   │   │   │   ├── AveragingFeedback.h
│   │   │   │   ├── AveragingGoal.h
│   │   │   │   ├── AveragingResult.h
│   │   │   │   ├── FibonacciAction.h
│   │   │   │   ├── FibonacciActionFeedback.h
│   │   │   │   ├── FibonacciActionGoal.h
│   │   │   │   ├── FibonacciActionResult.h
│   │   │   │   ├── FibonacciFeedback.h
│   │   │   │   ├── FibonacciGoal.h
│   │   │   │   └── FibonacciResult.h
│   │   │   ├── bond
│   │   │   │   ├── Constants.h
│   │   │   │   └── Status.h
│   │   │   ├── control_msgs
│   │   │   │   ├── FollowJointTrajectoryAction.h
│   │   │   │   ├── FollowJointTrajectoryActionFeedback.h
│   │   │   │   ├── FollowJointTrajectoryActionGoal.h
│   │   │   │   ├── FollowJointTrajectoryActionResult.h
│   │   │   │   ├── FollowJointTrajectoryFeedback.h
│   │   │   │   ├── FollowJointTrajectoryGoal.h
│   │   │   │   ├── FollowJointTrajectoryResult.h
│   │   │   │   ├── GripperCommand.h
│   │   │   │   ├── GripperCommandAction.h
│   │   │   │   ├── GripperCommandActionFeedback.h
│   │   │   │   ├── GripperCommandActionGoal.h
│   │   │   │   ├── GripperCommandActionResult.h
│   │   │   │   ├── GripperCommandFeedback.h
│   │   │   │   ├── GripperCommandGoal.h
│   │   │   │   ├── GripperCommandResult.h
│   │   │   │   ├── JointControllerState.h
│   │   │   │   ├── JointTolerance.h
│   │   │   │   ├── JointTrajectoryAction.h
│   │   │   │   ├── JointTrajectoryActionFeedback.h
│   │   │   │   ├── JointTrajectoryActionGoal.h
│   │   │   │   ├── JointTrajectoryActionResult.h
│   │   │   │   ├── JointTrajectoryControllerState.h
│   │   │   │   ├── JointTrajectoryFeedback.h
│   │   │   │   ├── JointTrajectoryGoal.h
│   │   │   │   ├── JointTrajectoryResult.h
│   │   │   │   ├── PointHeadAction.h
│   │   │   │   ├── PointHeadActionFeedback.h
│   │   │   │   ├── PointHeadActionGoal.h
│   │   │   │   ├── PointHeadActionResult.h
│   │   │   │   ├── PointHeadFeedback.h
│   │   │   │   ├── PointHeadGoal.h
│   │   │   │   ├── PointHeadResult.h
│   │   │   │   ├── QueryCalibrationState.h
│   │   │   │   ├── QueryTrajectoryState.h
│   │   │   │   ├── SingleJointPositionAction.h
│   │   │   │   ├── SingleJointPositionActionFeedback.h
│   │   │   │   ├── SingleJointPositionActionGoal.h
│   │   │   │   ├── SingleJointPositionActionResult.h
│   │   │   │   ├── SingleJointPositionFeedback.h
│   │   │   │   ├── SingleJointPositionGoal.h
│   │   │   │   └── SingleJointPositionResult.h
│   │   │   ├── diagnostic_msgs
│   │   │   │   ├── DiagnosticArray.h
│   │   │   │   ├── DiagnosticStatus.h
│   │   │   │   ├── KeyValue.h
│   │   │   │   └── SelfTest.h
│   │   │   ├── driver_base
│   │   │   │   ├── ConfigString.h
│   │   │   │   ├── ConfigValue.h
│   │   │   │   └── SensorLevels.h
│   │   │   ├── duration.cpp
│   │   │   ├── duration.o
│   │   │   ├── dynamic_reconfigure
│   │   │   │   ├── BoolParameter.h
│   │   │   │   ├── Config.h
│   │   │   │   ├── ConfigDescription.h
│   │   │   │   ├── DoubleParameter.h
│   │   │   │   ├── Group.h
│   │   │   │   ├── GroupState.h
│   │   │   │   ├── IntParameter.h
│   │   │   │   ├── ParamDescription.h
│   │   │   │   ├── Reconfigure.h
│   │   │   │   ├── SensorLevels.h
│   │   │   │   └── StrParameter.h
│   │   │   ├── examples
│   │   │   │   ├── ADC
│   │   │   │   │   └── ADC.pde
│   │   │   │   ├── Blink
│   │   │   │   │   └── Blink.pde
│   │   │   │   ├── BlinkM
│   │   │   │   │   ├── BlinkM.pde
│   │   │   │   │   └── BlinkM_funcs.h
│   │   │   │   ├── Clapper
│   │   │   │   │   └── Clapper.pde
│   │   │   │   ├── HelloWorld
│   │   │   │   │   └── HelloWorld.pde
│   │   │   │   ├── IrRanger
│   │   │   │   │   └── IrRanger.pde
│   │   │   │   ├── Logging
│   │   │   │   │   └── Logging.pde
│   │   │   │   ├── Odom
│   │   │   │   │   └── Odom.pde
│   │   │   │   ├── ServiceClient
│   │   │   │   │   ├── ServiceClient.pde
│   │   │   │   │   └── client.py
│   │   │   │   ├── ServiceServer
│   │   │   │   │   └── ServiceServer.pde
│   │   │   │   ├── ServoControl
│   │   │   │   │   └── ServoControl.pde
│   │   │   │   ├── Temperature
│   │   │   │   │   └── Temperature.pde
│   │   │   │   ├── TimeTF
│   │   │   │   │   └── TimeTF.pde
│   │   │   │   ├── Ultrasound
│   │   │   │   │   └── Ultrasound.pde
│   │   │   │   ├── button_example
│   │   │   │   │   └── button_example.pde
│   │   │   │   └── pubsub
│   │   │   │       └── pubsub.pde
│   │   │   ├── gazebo_msgs
│   │   │   │   ├── ApplyBodyWrench.h
│   │   │   │   ├── ApplyJointEffort.h
│   │   │   │   ├── BodyRequest.h
│   │   │   │   ├── ContactState.h
│   │   │   │   ├── ContactsState.h
│   │   │   │   ├── DeleteModel.h
│   │   │   │   ├── GetJointProperties.h
│   │   │   │   ├── GetLinkProperties.h
│   │   │   │   ├── GetLinkState.h
│   │   │   │   ├── GetModelProperties.h
│   │   │   │   ├── GetModelState.h
│   │   │   │   ├── GetPhysicsProperties.h
│   │   │   │   ├── GetWorldProperties.h
│   │   │   │   ├── JointRequest.h
│   │   │   │   ├── LinkState.h
│   │   │   │   ├── LinkStates.h
│   │   │   │   ├── ModelState.h
│   │   │   │   ├── ModelStates.h
│   │   │   │   ├── ODEJointProperties.h
│   │   │   │   ├── ODEPhysics.h
│   │   │   │   ├── SetJointProperties.h
│   │   │   │   ├── SetJointTrajectory.h
│   │   │   │   ├── SetLinkProperties.h
│   │   │   │   ├── SetLinkState.h
│   │   │   │   ├── SetModelConfiguration.h
│   │   │   │   ├── SetModelState.h
│   │   │   │   ├── SetPhysicsProperties.h
│   │   │   │   ├── SpawnModel.h
│   │   │   │   └── WorldState.h
│   │   │   ├── geometry_msgs
│   │   │   │   ├── Accel.h
│   │   │   │   ├── AccelStamped.h
│   │   │   │   ├── AccelWithCovariance.h
│   │   │   │   ├── AccelWithCovarianceStamped.h
│   │   │   │   ├── Inertia.h
│   │   │   │   ├── InertiaStamped.h
│   │   │   │   ├── Point.h
│   │   │   │   ├── Point32.h
│   │   │   │   ├── PointStamped.h
│   │   │   │   ├── Polygon.h
│   │   │   │   ├── PolygonStamped.h
│   │   │   │   ├── Pose.h
│   │   │   │   ├── Pose2D.h
│   │   │   │   ├── PoseArray.h
│   │   │   │   ├── PoseStamped.h
│   │   │   │   ├── PoseWithCovariance.h
│   │   │   │   ├── PoseWithCovarianceStamped.h
│   │   │   │   ├── Quaternion.h
│   │   │   │   ├── QuaternionStamped.h
│   │   │   │   ├── Transform.h
│   │   │   │   ├── TransformStamped.h
│   │   │   │   ├── Twist.h
│   │   │   │   ├── TwistStamped.h
│   │   │   │   ├── TwistWithCovariance.h
│   │   │   │   ├── TwistWithCovarianceStamped.h
│   │   │   │   ├── Vector3.h
│   │   │   │   ├── Vector3Stamped.h
│   │   │   │   ├── Wrench.h
│   │   │   │   └── WrenchStamped.h
│   │   │   ├── hector_mapping
│   │   │   │   ├── HectorDebugInfo.h
│   │   │   │   └── HectorIterData.h
│   │   │   ├── hector_nav_msgs
│   │   │   │   ├── GetDistanceToObstacle.h
│   │   │   │   ├── GetNormal.h
│   │   │   │   ├── GetRecoveryInfo.h
│   │   │   │   ├── GetRobotTrajectory.h
│   │   │   │   └── GetSearchPosition.h
│   │   │   ├── laser_assembler
│   │   │   │   ├── AssembleScans.h
│   │   │   │   └── AssembleScans2.h
│   │   │   ├── libros.a
│   │   │   ├── nav_msgs
│   │   │   │   ├── GetMap.h
│   │   │   │   ├── GetMapAction.h
│   │   │   │   ├── GetMapActionFeedback.h
│   │   │   │   ├── GetMapActionGoal.h
│   │   │   │   ├── GetMapActionResult.h
│   │   │   │   ├── GetMapFeedback.h
│   │   │   │   ├── GetMapGoal.h
│   │   │   │   ├── GetMapResult.h
│   │   │   │   ├── GetPlan.h
│   │   │   │   ├── GridCells.h
│   │   │   │   ├── MapMetaData.h
│   │   │   │   ├── OccupancyGrid.h
│   │   │   │   ├── Odometry.h
│   │   │   │   └── Path.h
│   │   │   ├── nodelet
│   │   │   │   ├── NodeletList.h
│   │   │   │   ├── NodeletLoad.h
│   │   │   │   └── NodeletUnload.h
│   │   │   ├── pcl_msgs
│   │   │   │   ├── ModelCoefficients.h
│   │   │   │   ├── PointIndices.h
│   │   │   │   ├── PolygonMesh.h
│   │   │   │   └── Vertices.h
│   │   │   ├── polled_camera
│   │   │   │   └── GetPolledImage.h
│   │   │   ├── riki_msgs
│   │   │   │   ├── PID.h
│   │   │   │   └── Velocities.h
│   │   │   ├── ros
│   │   │   │   ├── duration.h
│   │   │   │   ├── msg.h
│   │   │   │   ├── node_handle.h
│   │   │   │   ├── publisher.h
│   │   │   │   ├── service_client.h
│   │   │   │   ├── service_server.h
│   │   │   │   ├── subscriber.h
│   │   │   │   └── time.h
│   │   │   ├── ros.h
│   │   │   ├── ros_arduino_msgs
│   │   │   │   ├── CmdDiffVel.h
│   │   │   │   ├── Encoders.h
│   │   │   │   └── RawImu.h
│   │   │   ├── roscpp
│   │   │   │   ├── Empty.h
│   │   │   │   ├── GetLoggers.h
│   │   │   │   ├── Logger.h
│   │   │   │   └── SetLoggerLevel.h
│   │   │   ├── roscpp_tutorials
│   │   │   │   └── TwoInts.h
│   │   │   ├── rosgraph_msgs
│   │   │   │   ├── Clock.h
│   │   │   │   ├── Log.h
│   │   │   │   └── TopicStatistics.h
│   │   │   ├── rospy_tutorials
│   │   │   │   ├── AddTwoInts.h
│   │   │   │   ├── BadTwoInts.h
│   │   │   │   ├── Floats.h
│   │   │   │   └── HeaderString.h
│   │   │   ├── rosserial_arduino
│   │   │   │   ├── Adc.h
│   │   │   │   └── Test.h
│   │   │   ├── rosserial_msgs
│   │   │   │   ├── Log.h
│   │   │   │   ├── RequestMessageInfo.h
│   │   │   │   ├── RequestParam.h
│   │   │   │   ├── RequestServiceInfo.h
│   │   │   │   └── TopicInfo.h
│   │   │   ├── sensor_msgs
│   │   │   │   ├── CameraInfo.h
│   │   │   │   ├── ChannelFloat32.h
│   │   │   │   ├── CompressedImage.h
│   │   │   │   ├── FluidPressure.h
│   │   │   │   ├── Illuminance.h
│   │   │   │   ├── Image.h
│   │   │   │   ├── Imu.h
│   │   │   │   ├── JointState.h
│   │   │   │   ├── Joy.h
│   │   │   │   ├── JoyFeedback.h
│   │   │   │   ├── JoyFeedbackArray.h
│   │   │   │   ├── LaserEcho.h
│   │   │   │   ├── LaserScan.h
│   │   │   │   ├── MagneticField.h
│   │   │   │   ├── MultiDOFJointState.h
│   │   │   │   ├── MultiEchoLaserScan.h
│   │   │   │   ├── NavSatFix.h
│   │   │   │   ├── NavSatStatus.h
│   │   │   │   ├── PointCloud.h
│   │   │   │   ├── PointCloud2.h
│   │   │   │   ├── PointField.h
│   │   │   │   ├── Range.h
│   │   │   │   ├── RegionOfInterest.h
│   │   │   │   ├── RelativeHumidity.h
│   │   │   │   ├── SetCameraInfo.h
│   │   │   │   ├── Temperature.h
│   │   │   │   └── TimeReference.h
│   │   │   ├── shape_msgs
│   │   │   │   ├── Mesh.h
│   │   │   │   ├── MeshTriangle.h
│   │   │   │   ├── Plane.h
│   │   │   │   └── SolidPrimitive.h
│   │   │   ├── smach_msgs
│   │   │   │   ├── SmachContainerInitialStatusCmd.h
│   │   │   │   ├── SmachContainerStatus.h
│   │   │   │   └── SmachContainerStructure.h
│   │   │   ├── std_msgs
│   │   │   │   ├── Bool.h
│   │   │   │   ├── Byte.h
│   │   │   │   ├── ByteMultiArray.h
│   │   │   │   ├── Char.h
│   │   │   │   ├── ColorRGBA.h
│   │   │   │   ├── Duration.h
│   │   │   │   ├── Empty.h
│   │   │   │   ├── Float32.h
│   │   │   │   ├── Float32MultiArray.h
│   │   │   │   ├── Float64.h
│   │   │   │   ├── Float64MultiArray.h
│   │   │   │   ├── Header.h
│   │   │   │   ├── Int16.h
│   │   │   │   ├── Int16MultiArray.h
│   │   │   │   ├── Int32.h
│   │   │   │   ├── Int32MultiArray.h
│   │   │   │   ├── Int64.h
│   │   │   │   ├── Int64MultiArray.h
│   │   │   │   ├── Int8.h
│   │   │   │   ├── Int8MultiArray.h
│   │   │   │   ├── MultiArrayDimension.h
│   │   │   │   ├── MultiArrayLayout.h
│   │   │   │   ├── String.h
│   │   │   │   ├── Time.h
│   │   │   │   ├── UInt16.h
│   │   │   │   ├── UInt16MultiArray.h
│   │   │   │   ├── UInt32.h
│   │   │   │   ├── UInt32MultiArray.h
│   │   │   │   ├── UInt64.h
│   │   │   │   ├── UInt64MultiArray.h
│   │   │   │   ├── UInt8.h
│   │   │   │   └── UInt8MultiArray.h
│   │   │   ├── std_srvs
│   │   │   │   └── Empty.h
│   │   │   ├── stereo_msgs
│   │   │   │   └── DisparityImage.h
│   │   │   ├── tests
│   │   │   │   ├── array_test
│   │   │   │   │   └── array_test.pde
│   │   │   │   ├── float64_test
│   │   │   │   │   └── float64_test.pde
│   │   │   │   └── time_test
│   │   │   │       └── time_test.pde
│   │   │   ├── tf
│   │   │   │   ├── FrameGraph.h
│   │   │   │   ├── tf.h
│   │   │   │   ├── tfMessage.h
│   │   │   │   └── transform_broadcaster.h
│   │   │   ├── tf2_msgs
│   │   │   │   ├── FrameGraph.h
│   │   │   │   ├── LookupTransformAction.h
│   │   │   │   ├── LookupTransformActionFeedback.h
│   │   │   │   ├── LookupTransformActionGoal.h
│   │   │   │   ├── LookupTransformActionResult.h
│   │   │   │   ├── LookupTransformFeedback.h
│   │   │   │   ├── LookupTransformGoal.h
│   │   │   │   ├── LookupTransformResult.h
│   │   │   │   ├── TF2Error.h
│   │   │   │   └── TFMessage.h
│   │   │   ├── theora_image_transport
│   │   │   │   └── Packet.h
│   │   │   ├── time.cpp
│   │   │   ├── time.o
│   │   │   ├── topic_tools
│   │   │   │   ├── DemuxAdd.h
│   │   │   │   ├── DemuxDelete.h
│   │   │   │   ├── DemuxList.h
│   │   │   │   ├── DemuxSelect.h
│   │   │   │   ├── MuxAdd.h
│   │   │   │   ├── MuxDelete.h
│   │   │   │   ├── MuxList.h
│   │   │   │   └── MuxSelect.h
│   │   │   ├── trajectory_msgs
│   │   │   │   ├── JointTrajectory.h
│   │   │   │   ├── JointTrajectoryPoint.h
│   │   │   │   ├── MultiDOFJointTrajectory.h
│   │   │   │   └── MultiDOFJointTrajectoryPoint.h
│   │   │   ├── turtle_actionlib
│   │   │   │   ├── ShapeAction.h
│   │   │   │   ├── ShapeActionFeedback.h
│   │   │   │   ├── ShapeActionGoal.h
│   │   │   │   ├── ShapeActionResult.h
│   │   │   │   ├── ShapeFeedback.h
│   │   │   │   ├── ShapeGoal.h
│   │   │   │   ├── ShapeResult.h
│   │   │   │   └── Velocity.h
│   │   │   ├── turtlesim
│   │   │   │   ├── Color.h
│   │   │   │   ├── Kill.h
│   │   │   │   ├── Pose.h
│   │   │   │   ├── SetPen.h
│   │   │   │   ├── Spawn.h
│   │   │   │   ├── TeleportAbsolute.h
│   │   │   │   └── TeleportRelative.h
│   │   │   └── visualization_msgs
│   │   │       ├── ImageMarker.h
│   │   │       ├── InteractiveMarker.h
│   │   │       ├── InteractiveMarkerControl.h
│   │   │       ├── InteractiveMarkerFeedback.h
│   │   │       ├── InteractiveMarkerInit.h
│   │   │       ├── InteractiveMarkerPose.h
│   │   │       ├── InteractiveMarkerUpdate.h
│   │   │       ├── Marker.h
│   │   │       ├── MarkerArray.h
│   │   │       └── MenuEntry.h
│   │   └── Stm32Libs
│   │       ├── CMSIS_CM3
│   │       │   ├── arm_common_tables.h
│   │       │   ├── arm_const_structs.h
│   │       │   ├── arm_math.h
│   │       │   ├── core_cm0.h
│   │       │   ├── core_cm0plus.h
│   │       │   ├── core_cm4.h
│   │       │   ├── core_cm4_simd.h
│   │       │   ├── core_cmFunc.h
│   │       │   ├── core_cmInstr.h
│   │       │   ├── core_sc000.h
│   │       │   ├── core_sc300.h
│   │       │   ├── startup
│   │       │   │   └── gcc
│   │       │   │       ├── startup_stm32f030.s
│   │       │   │       ├── startup_stm32f031.s
│   │       │   │       ├── startup_stm32f042.s
│   │       │   │       ├── startup_stm32f051.s
│   │       │   │       ├── startup_stm32f072.s
│   │       │   │       └── startup_stm32f0xx.s
│   │       │   ├── stm32f0xx.h
│   │       │   ├── system_stm32f0xx.c
│   │       │   ├── system_stm32f0xx.h
│   │       │   └── system_stm32f0xx.o
│   │       ├── Makefile
│   │       ├── STM32F10x_StdPeriph_Driver
│   │       │   ├── inc
│   │       │   │   ├── stm32f0xx_adc.h
│   │       │   │   ├── stm32f0xx_can.h
│   │       │   │   ├── stm32f0xx_cec.h
│   │       │   │   ├── stm32f0xx_comp.h
│   │       │   │   ├── stm32f0xx_crc.h
│   │       │   │   ├── stm32f0xx_crs.h
│   │       │   │   ├── stm32f0xx_dac.h
│   │       │   │   ├── stm32f0xx_dbgmcu.h
│   │       │   │   ├── stm32f0xx_dma.h
│   │       │   │   ├── stm32f0xx_exti.h
│   │       │   │   ├── stm32f0xx_flash.h
│   │       │   │   ├── stm32f0xx_gpio.h
│   │       │   │   ├── stm32f0xx_i2c.h
│   │       │   │   ├── stm32f0xx_iwdg.h
│   │       │   │   ├── stm32f0xx_misc.h
│   │       │   │   ├── stm32f0xx_pwr.h
│   │       │   │   ├── stm32f0xx_rcc.h
│   │       │   │   ├── stm32f0xx_rtc.h
│   │       │   │   ├── stm32f0xx_spi.h
│   │       │   │   ├── stm32f0xx_syscfg.h
│   │       │   │   ├── stm32f0xx_tim.h
│   │       │   │   ├── stm32f0xx_usart.h
│   │       │   │   └── stm32f0xx_wwdg.h
│   │       │   ├── src
│   │       │   │   ├── stm32f0xx_adc.c
│   │       │   │   ├── stm32f0xx_adc.o
│   │       │   │   ├── stm32f0xx_can.c
│   │       │   │   ├── stm32f0xx_can.o
│   │       │   │   ├── stm32f0xx_cec.c
│   │       │   │   ├── stm32f0xx_cec.o
│   │       │   │   ├── stm32f0xx_comp.c
│   │       │   │   ├── stm32f0xx_comp.o
│   │       │   │   ├── stm32f0xx_crc.c
│   │       │   │   ├── stm32f0xx_crc.o
│   │       │   │   ├── stm32f0xx_crs.c
│   │       │   │   ├── stm32f0xx_crs.o
│   │       │   │   ├── stm32f0xx_dac.c
│   │       │   │   ├── stm32f0xx_dac.o
│   │       │   │   ├── stm32f0xx_dbgmcu.c
│   │       │   │   ├── stm32f0xx_dbgmcu.o
│   │       │   │   ├── stm32f0xx_dma.c
│   │       │   │   ├── stm32f0xx_dma.o
│   │       │   │   ├── stm32f0xx_exti.c
│   │       │   │   ├── stm32f0xx_exti.o
│   │       │   │   ├── stm32f0xx_flash.c
│   │       │   │   ├── stm32f0xx_flash.o
│   │       │   │   ├── stm32f0xx_gpio.c
│   │       │   │   ├── stm32f0xx_gpio.o
│   │       │   │   ├── stm32f0xx_i2c.c
│   │       │   │   ├── stm32f0xx_i2c.o
│   │       │   │   ├── stm32f0xx_iwdg.c
│   │       │   │   ├── stm32f0xx_iwdg.o
│   │       │   │   ├── stm32f0xx_misc.c
│   │       │   │   ├── stm32f0xx_misc.o
│   │       │   │   ├── stm32f0xx_pwr.c
│   │       │   │   ├── stm32f0xx_pwr.o
│   │       │   │   ├── stm32f0xx_rcc.c
│   │       │   │   ├── stm32f0xx_rcc.o
│   │       │   │   ├── stm32f0xx_rtc.c
│   │       │   │   ├── stm32f0xx_rtc.o
│   │       │   │   ├── stm32f0xx_spi.c
│   │       │   │   ├── stm32f0xx_spi.o
│   │       │   │   ├── stm32f0xx_syscfg.c
│   │       │   │   ├── stm32f0xx_syscfg.o
│   │       │   │   ├── stm32f0xx_tim.c
│   │       │   │   ├── stm32f0xx_tim.o
│   │       │   │   ├── stm32f0xx_usart.c
│   │       │   │   ├── stm32f0xx_usart.o
│   │       │   │   ├── stm32f0xx_wwdg.c
│   │       │   │   └── stm32f0xx_wwdg.o
│   │       │   └── stm32f0xx_conf.h
│   │       ├── STM32_USB-FS-Device_Driver
│   │       │   ├── inc
│   │       │   │   ├── otgd_fs_cal.h
│   │       │   │   ├── otgd_fs_dev.h
│   │       │   │   ├── otgd_fs_int.h
│   │       │   │   ├── otgd_fs_pcd.h
│   │       │   │   ├── otgd_fs_regs.h
│   │       │   │   ├── usb_core.h
│   │       │   │   ├── usb_def.h
│   │       │   │   ├── usb_init.h
│   │       │   │   ├── usb_int.h
│   │       │   │   ├── usb_lib.h
│   │       │   │   ├── usb_mem.h
│   │       │   │   ├── usb_regs.h
│   │       │   │   ├── usb_sil.h
│   │       │   │   └── usb_type.h
│   │       │   ├── src
│   │       │   │   ├── otgd_fs_cal.c
│   │       │   │   ├── otgd_fs_cal.o
│   │       │   │   ├── otgd_fs_dev.c
│   │       │   │   ├── otgd_fs_dev.o
│   │       │   │   ├── otgd_fs_int.c
│   │       │   │   ├── otgd_fs_int.o
│   │       │   │   ├── otgd_fs_pcd.c
│   │       │   │   ├── otgd_fs_pcd.o
│   │       │   │   ├── usb_core.c
│   │       │   │   ├── usb_core.o
│   │       │   │   ├── usb_init.c
│   │       │   │   ├── usb_init.o
│   │       │   │   ├── usb_int.c
│   │       │   │   ├── usb_int.o
│   │       │   │   ├── usb_mem.c
│   │       │   │   ├── usb_mem.o
│   │       │   │   ├── usb_regs.c
│   │       │   │   ├── usb_regs.o
│   │       │   │   ├── usb_sil.c
│   │       │   │   └── usb_sil.o
│   │       │   └── usb_conf.h
│   │       └── libstm32f1.a
│   ├── Makefile
│   ├── Makefile.include
│   ├── README
│   ├── README.md
│   ├── STM32F072VB_FLASH.ld
│   └── Src
│       └── main.cpp
└── toolchain
    └── gcc-arm-none-eabi-4_9-2015q3-20150921-linux.tar.bz2

79 directories, 525 files


标签: serial STM32 STM3 OSS SSE

实例下载地址

STM32通过rosserial接入ROS通讯开发

不能下载?内容有错? 点击这里报错 + 投诉 + 提问

好例子网口号:伸出你的我的手 — 分享

网友评论

发表评论

(您的评论需要经过审核才能显示)

查看所有0条评论>>

小贴士

感谢您为本站写下的评论,您的评论对其它用户来说具有重要的参考价值,所以请认真填写。

  • 类似“顶”、“沙发”之类没有营养的文字,对勤劳贡献的楼主来说是令人沮丧的反馈信息。
  • 相信您也不想看到一排文字/表情墙,所以请不要反馈意义不大的重复字符,也请尽量不要纯表情的回复。
  • 提问之前请再仔细看一遍楼主的说明,或许是您遗漏了。
  • 请勿到处挖坑绊人、招贴广告。既占空间让人厌烦,又没人会搭理,于人于己都无利。

关于好例子网

本站旨在为广大IT学习爱好者提供一个非营利性互相学习交流分享平台。本站所有资源都可以被免费获取学习研究。本站资源来自网友分享,对搜索内容的合法性不具有预见性、识别性、控制性,仅供学习研究,请务必在下载后24小时内给予删除,不得用于其他任何用途,否则后果自负。基于互联网的特殊性,平台无法对用户传输的作品、信息、内容的权属或合法性、安全性、合规性、真实性、科学性、完整权、有效性等进行实质审查;无论平台是否已进行审查,用户均应自行承担因其传输的作品、信息、内容而可能或已经产生的侵权或权属纠纷等法律责任。本站所有资源不代表本站的观点或立场,基于网友分享,根据中国法律《信息网络传播权保护条例》第二十二与二十三条之规定,若资源存在侵权或相关问题请联系本站客服人员,点此联系我们。关于更多版权及免责申明参见 版权及免责申明

;
报警