Event.FRAME_CONSTRUCTED

本文探讨了在ActionScript中使用MovieClip的gotoAndStop方法切换帧时,可能遇到getChildByName方法返回null的问题。通过在切换帧之后添加一个事件监听器并在其回调函数中获取所需组件,可以解决此问题。

_oPBox是个MovieClip,共3帧,其中第1帧有个TextField,名字叫txt_leftTime。

 

_oPBox.gotoAndStop(1);

_oPBox.getChildByName("txt_leftTime") as TextField

 

在某些情况下,我发现getChildByName会失效,即取到的对象变成了null.

 

后来查到了原因,在MovieClip使用gotoAndStop切换帧的时候,都会重新初始化里面的变量和内容。当未初始化完毕时,去取getChildByName,就有可能取不到。

 

解决办法是:

_oPBox.addEventListener(Event.FRAME_CONSTRUCTED, constructedHandler);

_oPBox.gotoAndStop(1);

 

然后在constructedHandler中去取_oPBox.getChildByName("txt_leftTime") as TextField

[ WARN] [1762076634.614271498]: Skipping virtual joint 'base_link' because its child frame 'base_link' does not match the URDF frame 'world' [ INFO] [1762076634.614330146]: No root/virtual joint specified in SRDF. Assuming fixed joint [ INFO] [1762076635.805948068]: Ready to take commands for planning group manipulator_i5. [INFO] [1762076635.806458]: AUBO安全控制器初始化完 [INFO] [1762076635.813104]: 使用保守参数: 速度=0.1, 加速度=0.1 roslaunch aubo_i5_moveit_config moveit_planning_execution.launch sim:=false robot_ip:=192.168.192.10 ... logging to /root/.ros/log/69be2d1c-b7d0-11f0-a111-2c9464039e34/roslaunch-tian-28357.log Checking log directory for disk usage. This may take a while. Press Ctrl-C to interrupt Done checking log file disk usage. Usage is <1GB. xacro: in-order processing became default in ROS Melodic. You can drop the option. started roslaunch server http://tian:34027/ SUMMARY ======== PARAMETERS * /aubo_driver/server_host: 192.168.192.10 * /controller_joint_names: ['shoulder_joint'... * /move_group/allow_trajectory_execution: True * /move_group/capabilities: * /move_group/controller_list: [{'default': True... * /move_group/disable_capabilities: * /move_group/jiggle_fraction: 0.05 * /move_group/manipulator_i5/default_planner_config: RRTConnect * /move_group/manipulator_i5/longest_valid_segment_fraction: 0.005 * /move_group/manipulator_i5/planner_configs: ['SBL', 'EST', 'L... * /move_group/manipulator_i5/projection_evaluator: joints(shoulder_j... * /move_group/max_range: 5.0 * /move_group/max_safe_path_cost: 1 * /move_group/moveit_controller_manager: moveit_simple_con... * /move_group/moveit_manage_controllers: True * /move_group/octomap_resolution: 0.025 * /move_group/planner_configs/BFMT/balanced: 0 * /move_group/planner_configs/BFMT/cache_cc: 1 * /move_group/planner_configs/BFMT/extended_fmt: 1 * /move_group/planner_configs/BFMT/heuristics: 1 * /move_group/planner_configs/BFMT/nearest_k: 1 * /move_group/planner_configs/BFMT/num_samples: 1000 * /move_group/planner_configs/BFMT/optimality: 1 * /move_group/planner_configs/BFMT/radius_multiplier: 1.0 * /move_group/planner_configs/BFMT/type: geometric::BFMT * /move_group/planner_configs/BKPIECE/border_fraction: 0.9 * /move_group/planner_configs/BKPIECE/failed_expansion_score_factor: 0.5 * /move_group/planner_configs/BKPIECE/min_valid_path_fraction: 0.5 * /move_group/planner_configs/BKPIECE/range: 0.0 * /move_group/planner_configs/BKPIECE/type: geometric::BKPIECE * /move_group/planner_configs/BiEST/range: 0.0 * /move_group/planner_configs/BiEST/type: geometric::BiEST * /move_group/planner_configs/BiTRRT/cost_threshold: 1e300 * /move_group/planner_configs/BiTRRT/frountier_node_ratio: 0.1 * /move_group/planner_configs/BiTRRT/frountier_threshold: 0.0 * /move_group/planner_configs/BiTRRT/init_temperature: 100 * /move_group/planner_configs/BiTRRT/range: 0.0 * /move_group/planner_configs/BiTRRT/temp_change_factor: 0.1 * /move_group/planner_configs/BiTRRT/type: geometric::BiTRRT * /move_group/planner_configs/EST/goal_bias: 0.05 * /move_group/planner_configs/EST/range: 0.0 * /move_group/planner_configs/EST/type: geometric::EST * /move_group/planner_configs/FMT/cache_cc: 1 * /move_group/planner_configs/FMT/extended_fmt: 1 * /move_group/planner_configs/FMT/heuristics: 0 * /move_group/planner_configs/FMT/nearest_k: 1 * /move_group/planner_configs/FMT/num_samples: 1000 * /move_group/planner_configs/FMT/radius_multiplier: 1.1 * /move_group/planner_configs/FMT/type: geometric::FMT * /move_group/planner_configs/KPIECE/border_fraction: 0.9 * /move_group/planner_configs/KPIECE/failed_expansion_score_factor: 0.5 * /move_group/planner_configs/KPIECE/goal_bias: 0.05 * /move_group/planner_configs/KPIECE/min_valid_path_fraction: 0.5 * /move_group/planner_configs/KPIECE/range: 0.0 * /move_group/planner_configs/KPIECE/type: geometric::KPIECE * /move_group/planner_configs/LBKPIECE/border_fraction: 0.9 * /move_group/planner_configs/LBKPIECE/min_valid_path_fraction: 0.5 * /move_group/planner_configs/LBKPIECE/range: 0.0 * /move_group/planner_configs/LBKPIECE/type: geometric::LBKPIECE * /move_group/planner_configs/LBTRRT/epsilon: 0.4 * /move_group/planner_configs/LBTRRT/goal_bias: 0.05 * /move_group/planner_configs/LBTRRT/range: 0.0 * /move_group/planner_configs/LBTRRT/type: geometric::LBTRRT * /move_group/planner_configs/LazyPRM/range: 0.0 * /move_group/planner_configs/LazyPRM/type: geometric::LazyPRM * /move_group/planner_configs/LazyPRMstar/type: geometric::LazyPR... * /move_group/planner_configs/PDST/type: geometric::PDST * /move_group/planner_configs/PRM/max_nearest_neighbors: 10 * /move_group/planner_configs/PRM/type: geometric::PRM * /move_group/planner_configs/PRMstar/type: geometric::PRMstar * /move_group/planner_configs/ProjEST/goal_bias: 0.05 * /move_group/planner_configs/ProjEST/range: 0.0 * /move_group/planner_configs/ProjEST/type: geometric::ProjEST * /move_group/planner_configs/RRT/goal_bias: 0.05 * /move_group/planner_configs/RRT/range: 0.0 * /move_group/planner_configs/RRT/type: geometric::RRT * /move_group/planner_configs/RRTConnect/range: 0.0 * /move_group/planner_configs/RRTConnect/type: geometric::RRTCon... * /move_group/planner_configs/RRTstar/delay_collision_checking: 1 * /move_group/planner_configs/RRTstar/goal_bias: 0.05 * /move_group/planner_configs/RRTstar/range: 0.0 * /move_group/planner_configs/RRTstar/type: geometric::RRTstar * /move_group/planner_configs/SBL/range: 0.0 * /move_group/planner_configs/SBL/type: geometric::SBL * /move_group/planner_configs/SPARS/dense_delta_fraction: 0.001 * /move_group/planner_configs/SPARS/max_failures: 1000 * /move_group/planner_configs/SPARS/sparse_delta_fraction: 0.25 * /move_group/planner_configs/SPARS/stretch_factor: 3.0 * /move_group/planner_configs/SPARS/type: geometric::SPARS * /move_group/planner_configs/SPARStwo/dense_delta_fraction: 0.001 * /move_group/planner_configs/SPARStwo/max_failures: 5000 * /move_group/planner_configs/SPARStwo/sparse_delta_fraction: 0.25 * /move_group/planner_configs/SPARStwo/stretch_factor: 3.0 * /move_group/planner_configs/SPARStwo/type: geometric::SPARStwo * /move_group/planner_configs/STRIDE/degree: 16 * /move_group/planner_configs/STRIDE/estimated_dimension: 0.0 * /move_group/planner_configs/STRIDE/goal_bias: 0.05 * /move_group/planner_configs/STRIDE/max_degree: 18 * /move_group/planner_configs/STRIDE/max_pts_per_leaf: 6 * /move_group/planner_configs/STRIDE/min_degree: 12 * /move_group/planner_configs/STRIDE/min_valid_path_fraction: 0.2 * /move_group/planner_configs/STRIDE/range: 0.0 * /move_group/planner_configs/STRIDE/type: geometric::STRIDE * /move_group/planner_configs/STRIDE/use_projected_distance: 0 * /move_group/planner_configs/TRRT/frountierNodeRatio: 0.1 * /move_group/planner_configs/TRRT/frountier_threshold: 0.0 * /move_group/planner_configs/TRRT/goal_bias: 0.05 * /move_group/planner_configs/TRRT/init_temperature: 10e-6 * /move_group/planner_configs/TRRT/k_constant: 0.0 * /move_group/planner_configs/TRRT/max_states_failed: 10 * /move_group/planner_configs/TRRT/min_temperature: 10e-10 * /move_group/planner_configs/TRRT/range: 0.0 * /move_group/planner_configs/TRRT/temp_change_factor: 2.0 * /move_group/planner_configs/TRRT/type: geometric::TRRT * /move_group/planning_plugin: ompl_interface/OM... * /move_group/planning_scene_monitor/publish_geometry_updates: True * /move_group/planning_scene_monitor/publish_planning_scene: True * /move_group/planning_scene_monitor/publish_state_updates: True * /move_group/planning_scene_monitor/publish_transforms_updates: True * /move_group/request_adapters: industrial_trajec... * /move_group/sample_duration: 0.005 * /move_group/sensors: [{'point_subsampl... * /move_group/start_state_max_bounds_error: 0.1 * /move_group/trajectory_execution/allowed_execution_duration_scaling: 4.0 * /move_group/trajectory_execution/allowed_goal_duration_margin: 0.5 * /move_group/trajectory_execution/allowed_start_tolerance: 0.01 * /move_group/trajectory_execution/execution_duration_monitoring: False * /robot_description: <?xml version="1.... * /robot_description_kinematics/manipulator_i5/kinematics_solver: kdl_kinematics_pl... * /robot_description_kinematics/manipulator_i5/kinematics_solver_search_resolution: 0.005 * /robot_description_kinematics/manipulator_i5/kinematics_solver_timeout: 0.005 * /robot_description_planning/joint_limits/foreArm_joint/has_acceleration_limits: False * /robot_description_planning/joint_limits/foreArm_joint/has_velocity_limits: True * /robot_description_planning/joint_limits/foreArm_joint/max_acceleration: 30 * /robot_description_planning/joint_limits/foreArm_joint/max_velocity: 3.14 * /robot_description_planning/joint_limits/shoulder_joint/has_acceleration_limits: False * /robot_description_planning/joint_limits/shoulder_joint/has_velocity_limits: True * /robot_description_planning/joint_limits/shoulder_joint/max_acceleration: 30 * /robot_description_planning/joint_limits/shoulder_joint/max_velocity: 3.14 * /robot_description_planning/joint_limits/upperArm_joint/has_acceleration_limits: False * /robot_description_planning/joint_limits/upperArm_joint/has_velocity_limits: True * /robot_description_planning/joint_limits/upperArm_joint/max_acceleration: 30 * /robot_description_planning/joint_limits/upperArm_joint/max_velocity: 3.14 * /robot_description_planning/joint_limits/wrist1_joint/has_acceleration_limits: False * /robot_description_planning/joint_limits/wrist1_joint/has_velocity_limits: True * /robot_description_planning/joint_limits/wrist1_joint/max_acceleration: 25 * /robot_description_planning/joint_limits/wrist1_joint/max_velocity: 2.6 * /robot_description_planning/joint_limits/wrist2_joint/has_acceleration_limits: False * /robot_description_planning/joint_limits/wrist2_joint/has_velocity_limits: True * /robot_description_planning/joint_limits/wrist2_joint/max_acceleration: 25 * /robot_description_planning/joint_limits/wrist2_joint/max_velocity: 2.6 * /robot_description_planning/joint_limits/wrist3_joint/has_acceleration_limits: False * /robot_description_planning/joint_limits/wrist3_joint/has_velocity_limits: True * /robot_description_planning/joint_limits/wrist3_joint/max_acceleration: 25 * /robot_description_planning/joint_limits/wrist3_joint/max_velocity: 2.6 * /robot_description_semantic: <?xml version="1.... * /robot_name: aubo_i5 * /rosdistro: melodic * /rosversion: 1.14.13 * /rviz_tian_28357_5613264337159122920/manipulator_i5/kinematics_solver: kdl_kinematics_pl... * /rviz_tian_28357_5613264337159122920/manipulator_i5/kinematics_solver_search_resolution: 0.005 * /rviz_tian_28357_5613264337159122920/manipulator_i5/kinematics_solver_timeout: 0.005 NODES / aubo_driver (aubo_driver/aubo_driver) aubo_joint_trajectory_action (aubo_controller/aubo_joint_trajectory_action) aubo_robot_simulator (aubo_controller/aubo_robot_simulator) move_group (moveit_ros_move_group/move_group) robot_state_publisher (robot_state_publisher/robot_state_publisher) rviz_tian_28357_5613264337159122920 (rviz/rviz) auto-starting new master process[master]: started with pid [28371] ROS_MASTER_URI=http://localhost:11311 setting /run_id to 69be2d1c-b7d0-11f0-a111-2c9464039e34 process[rosout-1]: started with pid [28382] started core service [/rosout] process[aubo_robot_simulator-2]: started with pid [28389] process[aubo_joint_trajectory_action-3]: started with pid [28390] process[aubo_driver-4]: started with pid [28391] process[robot_state_publisher-5]: started with pid [28393] [ INFO] [1762076620.975289494]: Adding shoulder_joint to list parameter [ INFO] [1762076620.976437205]: Adding upperArm_joint to list parameter [ INFO] [1762076620.976450447]: Adding foreArm_joint to list parameter [ INFO] [1762076620.976461219]: Adding wrist1_joint to list parameter [ INFO] [1762076620.976468429]: Adding wrist2_joint to list parameter [ INFO] [1762076620.976475474]: Adding wrist3_joint to list parameter [ INFO] [1762076620.976499775]: Found user-specified joint names in 'controller_joint_names': [shoulder_joint, upperArm_joint, foreArm_joint, wrist1_joint, wrist2_joint, wrist3_joint] [ INFO] [1762076620.976511379]: Filtered joint names to 6 joints process[move_group-6]: started with pid [28402] process[rviz_tian_28357_5613264337159122920-7]: started with pid [28412] log4cplus:ERROR could not open file ./config/tracelog.properties log4cplus:ERROR No appenders could be found for logger (ourrobottrace). log4cplus:ERROR Please initialize the log4cplus system properly. [ INFO] [1762076621.017125306]: Loading robot model 'aubo_i5'... [ WARN] [1762076621.017989247]: Skipping virtual joint 'base_link' because its child frame 'base_link' does not match the URDF frame 'world' [ INFO] [1762076621.018004978]: No root/virtual joint specified in SRDF. Assuming fixed joint [ INFO] [1762076621.068145876]: rviz version 1.13.30 [ INFO] [1762076621.068293956]: compiled against Qt version 5.9.5 [ INFO] [1762076621.068302158]: compiled against OGRE version 1.9.0 (Ghadamon) [ INFO] [1762076621.071714956]: Forcing OpenGl version 0. [INFO] [1762076621.293396]: Setting publish rate (hz) based on parameter: 50.000000 [INFO] [1762076621.294459]: Simulating manipulator with 6 joints: shoulder_joint, upperArm_joint, foreArm_joint, wrist1_joint, wrist2_joint, wrist3_joint [INFO] [1762076621.295511]: Setting motion update rate (hz): 200.000000 [WARN] [1762076621.296947]: Invalid initial_joint_state parameter, defaulting to all-zeros [INFO] [1762076621.297546]: Using initial joint state: [0.0, 0.0, 0.0, 0.0, 0.0, 0.0] [INFO] [1762076621.302005]: Starting motion worker in motion controller simulator [INFO] [1762076621.303133]: The velocity scale factor of the trajetory is: 1.000000 [INFO] [1762076621.306835]: Creating joint trajectory subscriber [INFO] [1762076621.308616]: Enable Switch [INFO] [1762076621.354461]: Clean up init [ INFO] [1762076621.490932917]: Stereo is NOT SUPPORTED [ INFO] [1762076621.490982853]: OpenGL device: NVIDIA GeForce GTX 1050 Ti/PCIe/SSE2 [ INFO] [1762076621.490998617]: OpenGl version: 4.6 (GLSL 4.6). [ INFO] [1762076621.527283296]: Publishing maintained planning scene on 'monitored_planning_scene' [ INFO] [1762076621.528627766]: MoveGroup debug mode is OFF Starting planning scene monitors... [ INFO] [1762076621.528645797]: Starting planning scene monitor [ INFO] [1762076621.529857849]: Listening to '/planning_scene' [ INFO] [1762076621.529872699]: Starting world geometry update monitor for collision objects, attached objects, octomap updates. [ INFO] [1762076621.530897643]: Listening to '/collision_object' [ INFO] [1762076621.531963313]: Listening to '/planning_scene_world' for planning scene world geometry [ INFO] [1762076622.535972708]: Listening to '/head_mount_kinect/depth_registered/points' using message filter with target frame 'world ' [ INFO] [1762076622.538405886]: Listening to '/attached_collision_object' for attached collision objects Planning scene monitors started. [ INFO] [1762076622.554456326]: Initializing OMPL interface using ROS parameters [ INFO] [1762076622.565566122]: Using planning interface 'OMPL' [ INFO] [1762076622.567477284]: Constructing N point filter [ INFO] [1762076622.568748991]: Param 'default_workspace_bounds' was not set. Using default value: 10 [ INFO] [1762076622.569256661]: Param 'start_state_max_bounds_error' was set to 0.1 [ INFO] [1762076622.569523339]: Param 'start_state_max_dt' was not set. Using default value: 0.5 [ INFO] [1762076622.570007206]: Param 'start_state_max_dt' was not set. Using default value: 0.5 [ INFO] [1762076622.570270603]: Param 'jiggle_fraction' was set to 0.05 [ INFO] [1762076622.570527226]: Param 'max_sampling_attempts' was not set. Using default value: 100 [ INFO] [1762076622.570586021]: Using planning request adapter 'Trajectory filter 'UniformSampleFilter' of type 'UniformSampleFilter'' [ INFO] [1762076622.570597617]: Using planning request adapter 'Add Time Parameterization' [ INFO] [1762076622.570606717]: Using planning request adapter 'Fix Workspace Bounds' [ INFO] [1762076622.570622499]: Using planning request adapter 'Fix Start State Bounds' [ INFO] [1762076622.570642885]: Using planning request adapter 'Fix Start State In Collision' [ INFO] [1762076622.570662345]: Using planning request adapter 'Fix Start State Path Constraints' [ INFO] [1762076622.867106380]: Added FollowJointTrajectory controller for aubo_i5_controller [ INFO] [1762076622.867371382]: Returned 1 controllers in list [ INFO] [1762076622.900353684]: Trajectory execution is managing controllers Loading 'move_group/ApplyPlanningSceneService'... Loading 'move_group/ClearOctomapService'... Loading 'move_group/MoveGroupCartesianPathService'... Loading 'move_group/MoveGroupExecuteTrajectoryAction'... Loading 'move_group/MoveGroupGetPlanningSceneService'... Loading 'move_group/MoveGroupKinematicsService'... Loading 'move_group/MoveGroupMoveAction'... Loading 'move_group/MoveGroupPickPlaceAction'... Loading 'move_group/MoveGroupPlanService'... Loading 'move_group/MoveGroupQueryPlannersService'... Loading 'move_group/MoveGroupStateValidationService'... [ INFO] [1762076622.955447007]: ******************************************************** * MoveGroup using: * - ApplyPlanningSceneService * - ClearOctomapService * - CartesianPathService * - ExecuteTrajectoryAction * - GetPlanningSceneService * - KinematicsService * - MoveAction * - PickPlaceAction * - MotionPlanService * - QueryPlannersService * - StateValidationService ******************************************************** [ INFO] [1762076622.955481294]: MoveGroup context using planning plugin ompl_interface/OMPLPlanner [ INFO] [1762076622.955495059]: MoveGroup context initialization complete You can start planning now! [ INFO] [1762076624.756700336]: Loading robot model 'aubo_i5'... [ WARN] [1762076624.756746443]: Skipping virtual joint 'base_link' because its child frame 'base_link' does not match the URDF frame 'world' [ INFO] [1762076624.756771581]: No root/virtual joint specified in SRDF. Assuming fixed joint [ INFO] [1762076625.264448710]: Starting planning scene monitor [ INFO] [1762076625.266530944]: Listening to '/move_group/monitored_planning_scene' [ INFO] [1762076625.686336464]: Constructing new MoveGroup connection for group 'manipulator_i5' in namespace '' [ INFO] [1762076626.877045917]: Ready to take commands for planning group manipulator_i5. [ INFO] [1762076626.877183789]: Looking around: no [ INFO] [1762076626.877245273]: Replanning: no [ INFO] [1762076643.174830115]: Combined planning and execution request received for MoveGroup action. Forwarding to planning and execution pipeline. [ INFO] [1762076643.175277031]: Planning attempt 1 of at most 1 [ INFO] [1762076643.176738253]: Using a sample_duration value of 0.005 [ INFO] [1762076643.180184117]: Planner configuration 'manipulator_i5' will use planner 'geometric::RRTConnect'. Additional configuration parameters will be set when the planner is constructed. [ INFO] [1762076643.182625931]: RRTConnect: Starting planning with 1 states already in datastructure [ INFO] [1762076643.182831809]: RRTConnect: Starting planning with 1 states already in datastructure [ INFO] [1762076643.182985284]: RRTConnect: Starting planning with 1 states already in datastructure [ INFO] [1762076643.183155704]: RRTConnect: Starting planning with 1 states already in datastructure [ INFO] [1762076643.196664477]: RRTConnect: Created 4 states (2 start + 2 goal) [ INFO] [1762076643.196880812]: RRTConnect: Created 5 states (2 start + 3 goal) [ INFO] [1762076643.197507341]: RRTConnect: Created 5 states (2 start + 3 goal) [ INFO] [1762076643.197718645]: RRTConnect: Created 4 states (2 start + 2 goal) [ INFO] [1762076643.198230738]: ParallelPlan::solve(): Solution found by one or more threads in 0.016307 seconds [ INFO] [1762076643.199047044]: RRTConnect: Starting planning with 1 states already in datastructure [ INFO] [1762076643.199217949]: RRTConnect: Starting planning with 1 states already in datastructure [ INFO] [1762076643.199394720]: RRTConnect: Starting planning with 1 states already in datastructure [ INFO] [1762076643.199539848]: RRTConnect: Starting planning with 1 states already in datastructure [ INFO] [1762076643.203516801]: RRTConnect: Created 5 states (2 start + 3 goal) [ INFO] [1762076643.203977054]: RRTConnect: Created 4 states (2 start + 2 goal) [ INFO] [1762076643.204789531]: RRTConnect: Created 4 states (2 start + 2 goal) [ INFO] [1762076643.205275657]: RRTConnect: Created 5 states (2 start + 3 goal) [ INFO] [1762076643.205579430]: ParallelPlan::solve(): Solution found by one or more threads in 0.006801 seconds [ INFO] [1762076643.206133622]: RRTConnect: Starting planning with 1 states already in datastructure [ INFO] [1762076643.206314425]: RRTConnect: Starting planning with 1 states already in datastructure [ INFO] [1762076643.210023941]: RRTConnect: Created 4 states (2 start + 2 goal) [ INFO] [1762076643.210188376]: RRTConnect: Created 4 states (2 start + 2 goal) [ INFO] [1762076643.210713824]: ParallelPlan::solve(): Solution found by one or more threads in 0.004754 seconds [ INFO] [1762076643.226914630]: SimpleSetup: Path simplification took 0.015846 seconds and changed from 3 to 2 states [ INFO] [1762076643.229838490]: Interpolated time exceeds original trajectory (quitting), original: 1.64812 final interpolated time: 1.65 [ INFO] [1762076643.229965778]: Uniform sampling, resample duraction: 0.005 input traj. size: 4 output traj. size: 331 [ INFO] [1762076643.241589040]: Disabling trajectory recording [ INFO] [1762076643.249267809]: Received new goal [ INFO] [1762076643.249383221]: Publishing trajectory [INFO] [1762076643.254872]: Received trajectory with 331 points [INFO] [1762076643.257125]: Velocity scale factor: 1.0 [ERROR] [1762076643.263622]: Unexpected exception: int() argument must be a string, a bytes-like object or a number, not 'Duration' [INFO] [1762076643.284360]: Added new trajectory with 331 points [ INFO] [1762076645.072204824]: Inside goal constraints, stopped moving, return success for action [ INFO] [1762076645.073066959]: Controller aubo_i5_controller successfully finished [ INFO] [1762076645.131429419]: Completed trajectory execution with status SUCCEEDED ... [ INFO] [1762076645.141135973]: trajectory execution status: stop1 [ INFO] [1762076645.141144669]: Received event 'stop' [ERROR] [1762076645.141260396]: To transition to an aborted state, the goal must be in a preempting or active state, it is currently in state: 3 [ INFO] [1762076645.390044200]: Combined planning and execution request received for MoveGroup action. Forwarding to planning and execution pipeline. [ INFO] [1762076645.390232795]: Planning attempt 1 of at most 1 [ INFO] [1762076645.391435158]: Planner configuration 'manipulator_i5' will use planner 'geometric::RRTConnect'. Additional configuration parameters will be set when the planner is constructed. [ INFO] [1762076645.392501038]: RRTConnect: Starting planning with 1 states already in datastructure [ INFO] [1762076645.392765325]: RRTConnect: Starting planning with 1 states already in datastructure [ INFO] [1762076645.392996916]: RRTConnect: Starting planning with 1 states already in datastructure [ INFO] [1762076645.393232737]: RRTConnect: Starting planning with 1 states already in datastructure [ INFO] [1762076645.405152731]: RRTConnect: Created 4 states (2 start + 2 goal) [ INFO] [1762076645.406623163]: RRTConnect: Created 5 states (2 start + 3 goal) [ INFO] [1762076645.407075831]: RRTConnect: Created 4 states (2 start + 2 goal) [ INFO] [1762076645.407262705]: RRTConnect: Created 5 states (2 start + 3 goal) [ INFO] [1762076645.407673599]: ParallelPlan::solve(): Solution found by one or more threads in 0.015443 seconds [ INFO] [1762076645.408471126]: RRTConnect: Starting planning with 1 states already in datastructure [ INFO] [1762076645.408854773]: RRTConnect: Starting planning with 1 states already in datastructure [ INFO] [1762076645.409019127]: RRTConnect: Starting planning with 1 states already in datastructure [ INFO] [1762076645.409187565]: RRTConnect: Starting planning with 1 states already in datastructure [ INFO] [1762076645.410172203]: RRTConnect: Created 4 states (2 start + 2 goal) [ INFO] [1762076645.414208863]: RRTConnect: Created 4 states (2 start + 2 goal) [ INFO] [1762076645.414576171]: RRTConnect: Created 5 states (2 start + 3 goal) [ INFO] [1762076645.415038020]: RRTConnect: Created 5 states (2 start + 3 goal) [ INFO] [1762076645.415411858]: ParallelPlan::solve(): Solution found by one or more threads in 0.007207 seconds [ INFO] [1762076645.415915443]: RRTConnect: Starting planning with 1 states already in datastructure [ INFO] [1762076645.416264033]: RRTConnect: Starting planning with 1 states already in datastructure [ INFO] [1762076645.420120818]: RRTConnect: Created 5 states (2 start + 3 goal) [ INFO] [1762076645.420431203]: RRTConnect: Created 5 states (2 start + 3 goal) [ INFO] [1762076645.420816818]: ParallelPlan::solve(): Solution found by one or more threads in 0.005031 seconds [ INFO] [1762076645.428721527]: SimpleSetup: Path simplification took 0.007722 seconds and changed from 3 to 2 states [ INFO] [1762076645.431648243]: Interpolated time exceeds original trajectory (quitting), original: 2.78717 final interpolated time: 2.79 [ INFO] [1762076645.431751832]: Uniform sampling, resample duraction: 0.005 input traj. size: 4 output traj. size: 559 [ INFO] [1762076645.450663603]: Received new goal [ INFO] [1762076645.450732490]: Publishing trajectory [INFO] [1762076645.467334]: Received trajectory with 559 points [INFO] [1762076645.469154]: Velocity scale factor: 1.0 [ERROR] [1762076645.480497]: Unexpected exception: int() argument must be a string, a bytes-like object or a number, not 'Duration' [ERROR] [1762076645.492113]: Unexpected exception: int() argument must be a string, a bytes-like object or a number, not 'Duration' [INFO] [1762076645.493956]: Added new trajectory with 559 points [ERROR] [1762076645.494570]: Unexpected exception: int() argument must be a string, a bytes-like object or a number, not 'Duration'
11-03
Use of stream types is deprecated for operations other than volume control 08-06 16:39:08.069037 6748 6748 W MediaPlayer: See the documentation of setAudioStreamType() for what to use instead with android.media.AudioAttributes to qualify your playback use case 08-06 16:39:08.069569 2463 14868 D NuPlayerDriver: seekTo(0xb400007c57522900) (0 ms, 0) at state 4 08-06 16:39:08.070123 6748 10059 D C2NodeImpl: getInputBufferParams: wxh 940x1920, delay 16 08-06 16:39:08.070208 6748 10059 D BufferQueueConsumer: [GraphicBufferSource](id:1a5c00000016,api:0,p:-1,c:6748) setMaxAcquiredBufferCount: 16 08-06 16:39:08.070235 6748 10059 D GraphicBufferSource: setting dataspace: 0x104, acquired=0 08-06 16:39:08.070272 2463 10083 I GenericSource: start 08-06 16:39:08.070320 6748 6748 D MediaPlayer: MediaPlayer start called 08-06 16:39:08.070520 6748 10059 D CCodec : ISConfig not changed 08-06 16:39:08.072474 2463 2463 D NuPlayerDriver: start(0xb400007c57522900)+ state is 4, eos is 0 08-06 16:39:08.072620 2463 2463 D NuPlayerDriver: start(0xb400007c57522900)- 08-06 16:39:08.073196 2463 10083 D OplusNuPlayer: videoSlowSync, onStart, isVideoSlowSync = 0 08-06 16:39:08.073290 6748 6748 I KLog : [I] [Tid: 496529952920] RecorderUtils| isRecordFailedCode: error code match, module:kRecorder, level:kP0, DetailCode:206 08-06 16:39:08.074290 2463 10083 D AtlasEventUploadUtils: setEvent event:atlas_event_audio_filename 08-06 16:39:08.075138 3377 9757 D Telecom : h2: onPlaybackConfigChanged: config=AudioPlaybackConfiguration piid:1863 deviceIds:[] type:android.media.SoundPool u/pid:10161/4384 state:idle attr:AudioAttributes: usage=USAGE_ASSISTANCE_SONIFICATION content=CONTENT_TYPE_SONIFICATION flags=0x800 tags= bundle=null sessionId:0 mutedState:none FormatInfo{isSpatialized=false, channelMask=0x0, sampleRate=0} 08-06 16:39:08.075223 3377 9757 D Telecom : h2: onPlaybackConfigChanged: config=AudioPlaybackConfiguration piid:2375 deviceIds:[] type:android.media.SoundPool u/pid:10242/8287 state:idle attr:AudioAttributes: usage=USAGE_ASSISTANCE_SONIFICATION content=CONTENT_TYPE_SONIFICATION flags=0x800 tags= bundle=null sessionId:0 mutedState:none FormatInfo{isSpatialized=false, channelMask=0x0, sampleRate=0} 08-06 16:39:08.075258 3377 9757 D Telecom : h2: onPlaybackConfigChanged: config=AudioPlaybackConfiguration piid:4167 deviceIds:[] type:android.media.MediaPlayer u/pid:10373/6748 state:idle attr:AudioAttributes: usage=USAGE_UNKNOWN content=CONTENT_TYPE_UNKNOWN flags=0x800 tags= bundle=null sessionId:11417 mutedState:none FormatInfo{isSpatialized=false, channelMask=0x0, sampleRate=0} 08-06 16:39:08.075277 3377 9757 D Telecom : h2: onPlaybackConfigChanged: config=AudioPlaybackConfiguration piid:143 deviceIds:[] type:android.media.SoundPool u/pid:1000/3377 state:idle attr:AudioAttributes: usage=USAGE_ASSISTANCE_SONIFICATION content=CONTENT_TYPE_SONIFICATION flags=0x800 tags= bundle=null sessionId:0 mutedState:none FormatInfo{isSpatialized=false, channelMask=0x0, sampleRate=0} 08-06 16:39:08.075295 3377 9757 D Telecom : h2: onPlaybackConfigChanged: config=AudioPlaybackConfiguration piid:1487 deviceIds:[] type:android.media.SoundPool u/pid:10161/4384 state:idle attr:AudioAttributes: usage=USAGE_ASSISTANCE_SONIFICATION content=CONTENT_TYPE_SONIFICATION flags=0x800 tags= bundle=null sessionId:0 mutedState:none FormatInfo{isSpatialized=false, channelMask=0x0, sampleRate=0} 08-06 16:39:08.075522 2463 10083 D NuPlayerDriver: notifySeekComplete(0xb400007c57522900) 08-06 16:39:08.078080 2463 10083 D OplusNuPlayer: videoSlowSync, onStart, isVideoSlowSync = 0 08-06 16:39:08.078120 2463 10083 D AtlasEventUploadUtils: setEvent event:atlas_event_audio_filename 08-06 16:39:08.082494 6748 6748 I KLog : [I] [Tid: 496529952920] FaceMagicLog jni : nativeGetFaceMagicInfo 08-06 16:39:08.083268 14336 14336 I mydevices[core].AudioPlaybackMonitor: (main)notifyPlaybackConfigChanged 08-06 16:39:08.083308 14336 14336 I mydevices[core].AudioPlaybackMonitor: (main)checkPlaybackChanged 08-06 16:39:08.083695 3377 9757 D Telecom : h2: onPlaybackConfigChanged: config=AudioPlaybackConfiguration piid:4111 deviceIds:[] type:android.media.SoundPool u/pid:10104/730 state:idle attr:AudioAttributes: usage=USAGE_ASSISTANCE_SONIFICATION content=CONTENT_TYPE_SONIFICATION flags=0x800 tags= bundle=null sessionId:0 mutedState:none FormatInfo{isSpatialized=false, channelMask=0x0, sampleRate=0} 08-06 16:39:08.083740 3377 9757 D Telecom : h2: onPlaybackConfigChanged: config=AudioPlaybackConfiguration piid:4175 deviceIds:[] type:android.media.MediaPlayer u/pid:10373/6748 state:started attr:AudioAttributes: usage=USAGE_MEDIA content=CONTENT_TYPE_UNKNOWN flags=0x800 tags= bundle=null sessionId:11425 mutedState:none FormatInfo{isSpatialized=false, channelMask=0x0, sampleRate=0} 08-06 16:39:08.083770 3377 9757 D Telecom : h2: onPlaybackConfigChanged: config=AudioPlaybackConfiguration piid:151 deviceIds:[] type:android.media.SoundPool u/pid:10242/8287 state:idle attr:AudioAttributes: usage=USAGE_ASSISTANCE_SONIFICATION content=CONTENT_TYPE_SONIFICATION flags=0x800 tags= bundle=null sessionId:0 mutedState:none FormatInfo{isSpatialized=false, channelMask=0x0, sampleRate=0} 08-06 16:39:08.083798 3377 9757 D Telecom : h2: onPlaybackConfigChanged: config=AudioPlaybackConfiguration piid:1879 deviceIds:[] type:android.media.SoundPool u/pid:10145/21352 state:idle attr:AudioAttributes: usage=USAGE_ASSISTANCE_SONIFICATION content=CONTENT_TYPE_SONIFICATION flags=0x800 tags= bundle=null sessionId:0 mutedState:none FormatInfo{isSpatialized=false, channelMask=0x0, sampleRate=0} 08-06 16:39:08.083815 3377 9757 D Telecom : h2: onPlaybackConfigChanged: config=AudioPlaybackConfiguration piid:2007 deviceIds:[] type:android.media.SoundPool u/pid:10145/21352 state:idle attr:AudioAttributes: usage=USAGE_ASSISTANCE_SONIFICATION content=CONTENT_TYPE_SONIFICATION flags=0x800 tags= bundle=null sessionId:0 mutedState:none FormatInfo{isSpatialized=false, channelMask=0x0, sampleRate=0} 08-06 16:39:08.083851 3377 9757 D Telecom : h2: onPlaybackConfigChanged: config=AudioPlaybackConfiguration piid:3671 deviceIds:[2] type:android.media.MediaPlayer u/pid:10356/6308 state:stopped attr:AudioAttributes: usage=USAGE_MEDIA content=CONTENT_TYPE_UNKNOWN flags=0x800 tags= bundle=null sessionId:10881 mutedState:streamVolume portVolume FormatInfo{isSpatialized=false, channelMask=0x1, sampleRate=44100} 08-06 16:39:08.083885 3377 9757 D Telecom : h2: onPlaybackConfigChanged: config=AudioPlaybackConfiguration piid:4055 deviceIds:[] type:android.media.AudioTrack u/pid:10356/6308 state:idle attr:AudioAttributes: usage=USAGE_MEDIA content=CONTENT_TYPE_UNKNOWN flags=0xA00 tags= bundle=null sessionId:11265 mutedState:none FormatInfo{isSpatialized=false, channelMask=0x0, sampleRate=0} 08-06 16:39:08.083902 3377 9757 D Telecom : h2: onPlaybackConfigChanged: config=AudioPlaybackConfiguration piid:159 deviceIds:[] type:android.media.SoundPool u/pid:10242/8287 state:idle attr:AudioAttributes: usage=USAGE_ASSISTANCE_SONIFICATION content=CONTENT_TYPE_SONIFICATION flags=0x800 tags= bundle=null sessionId:0 mutedState:none FormatInfo{isSpatialized=false, channelMask=0x0, sampleRate=0} 08-06 16:39:08.083919 3377 9757 D Telecom : h2: onPlaybackConfigChanged: config=AudioPlaybackConfiguration piid:2783 deviceIds:[] type:android.media.SoundPool u/pid:1000/30442 state:idle attr:AudioAttributes: usage=USAGE_ASSISTANCE_SONIFICATION content=CONTENT_TYPE_SONIFICATION flags=0x800 tags= bundle=null sessionId:0 mutedState:none FormatInfo{isSpatialized=false, channelMask=0x0, sampleRate=0} 08-06 16:39:08.083937 3377 9757 D Telecom : h2: onPlaybackConfigChanged: config=AudioPlaybackConfiguration piid:231 deviceIds:[] type:android.media.SoundPool u/pid:10242/8287 state:idle attr:AudioAttributes: usage=USAGE_ASSISTANCE_SONIFICATION content=CONTENT_TYPE_SONIFICATION flags=0x800 tags= bundle=null sessionId:0 mutedState:none FormatInfo{isSpatialized=false, channelMask=0x0, sampleRate=0} 08-06 16:39:08.083952 3377 9757 D Telecom : h2: onPlaybackConfigChanged: config=AudioPlaybackConfiguration piid:295 deviceIds:[] type:android.media.SoundPool u/pid:10242/8287 state:idle attr:AudioAttributes: usage=USAGE_ASSISTANCE_SONIFICATION content=CONTENT_TYPE_SONIFICATION flags=0x800 tags= bundle=null sessionId:0 mutedState:none FormatInfo{isSpatialized=false, channelMask=0x0, sampleRate=0} 08-06 16:39:08.083971 3377 9757 D Telecom : h2: onPlaybackConfigChanged: config=AudioPlaybackConfiguration piid:2791 deviceIds:[] type:android.media.SoundPool u/pid:1000/30442 state:idle attr:AudioAttributes: usage=USAGE_ASSISTANCE_SONIFICATION content=CONTENT_TYPE_SONIFICATION flags=0x800 tags= bundle=null sessionId:0 mutedState:none FormatInfo{isSpatialized=false, channelMask=0x0, sampleRate=0} 08-06 16:39:08.084012 3377 9757 D Telecom : h2: onPlaybackConfigChanged: config=AudioPlaybackConfiguration piid:4071 deviceIds:[2] type:android.media.AudioTrack u/pid:10356/6308 state:started attr:AudioAttributes: usage=USAGE_MEDIA content=CONTENT_TYPE_UNKNOWN flags=0xA00 tags= bundle=null sessionId:11281 mutedState:clientVolume FormatInfo{isSpatialized=false, channelMask=0x3, sampleRate=44100} 08-06 16:39:08.084036 3377 9757 D Telecom : h2: onPlaybackConfigChanged: config=AudioPlaybackConfiguration piid:2735 deviceIds:[] type:android.media.SoundPool u/pid:10361/27907 state:idle attr:AudioAttributes: usage=USAGE_ASSISTANCE_SONIFICATION content=CONTENT_TYPE_SONIFICATION flags=0x800 tags= bundle=null sessionId:0 mutedState:none FormatInfo{isSpatialized=false, channelMask=0x0, sampleRate=0} 08-06 16:39:08.084058 3377 9757 D Telecom : h2: onPlaybackConfigChanged: config=AudioPlaybackConfiguration piid:3631 deviceIds:[] type:android.media.AudioTrack u/pid:10356/6308 state:paused attr:AudioAttributes: usage=USAGE_MEDIA content=CONTENT_TYPE_UNKNOWN flags=0xA00 tags= bundle=null sessionId:10841 mutedState:streamVolume portVolume FormatInfo{isSpatialized=false, channelMask=0x3, sampleRate=44100} 08-06 16:39:08.084092 3377 9757 D Telecom : h2: onPlaybackConfigChanged: config=AudioPlaybackConfiguration piid:3695 deviceIds:[] type:android.media.AudioTrack u/pid:10356/6308 state:idle attr:AudioAttributes: usage=USAGE_MEDIA content=CONTENT_TYPE_UNKNOWN flags=0xA00 tags= bundle=null sessionId:10905 mutedState:none FormatInfo{isSpatialized=false, channelMask=0x0, sampleRate=0} 08-06 16:39:08.084113 3377 9757 D Telecom : h2: onPlaybackConfigChanged: config=AudioPlaybackConfiguration piid:2295 deviceIds:[] type:android.media.SoundPool u/pid:10136/28604 state:idle attr:AudioAttributes: usage=USAGE_ASSISTANCE_SONIFICATION content=CONTENT_TYPE_SONIFICATION flags=0x800 tags= bundle=null sessionId:0 mutedState:none FormatInfo{isSpatialized=false, channelMask=0x0, sampleRate=0} 08-06 16:39:08.084142 3377 9757 D Telecom : h2: onPlaybackConfigChanged: config=AudioPlaybackConfiguration piid:2359 deviceIds:[] type:android.media.SoundPool u/pid:10339/27020 state:idle attr:AudioAttributes: usage=USAGE_ASSISTANCE_SONIFICATION content=CONTENT_TYPE_SONIFICATION flags=0x800 tags= bundle=null sessionId:0 mutedState:none FormatInfo{isSpatialized=false, channelMask=0x0, sampleRate=0} 08-06 16:39:08.084172 3377 9757 D Telecom : h2: onPlaybackConfigChanged: config=AudioPlaybackConfiguration piid:2423 deviceIds:[] type:android.media.SoundPool u/pid:10370/4607 state:idle attr:AudioAttributes: usage=USAGE_ASSISTANCE_SONIFICATION content=CONTENT_TYPE_SONIFICATION flags=0x801 tags= bundle=null sessionId:0 mutedState:none FormatInfo{isSpatialized=false, channelMask=0x0, sampleRate=0} 08-06 16:39:08.084190 3377 9757 D Telecom : h2: onPlaybackConfigChanged: config=AudioPlaybackConfiguration piid:3639 deviceIds:[] type:android.media.MediaPlayer u/pid:10356/6308 state:idle attr:AudioAttributes: usage=USAGE_UNKNOWN content=CONTENT_TYPE_UNKNOWN flags=0x800 tags= bundle=null sessionId:10849 mutedState:none FormatInfo{isSpatialized=false, channelMask=0x0, sampleRate=0} 08-06 16:39:08.084206 3377 9757 D Telecom : h2: onPlaybackConfigChanged: config=AudioPlaybackConfiguration piid:4087 deviceIds:[] type:android.media.MediaPlayer u/pid:10339/27020 state:idle attr:AudioAttributes: usage=USAGE_UNKNOWN content=CONTENT_TYPE_UNKNOWN flags=0x800 tags= bundle=null sessionId:11305 mutedState:none FormatInfo{isSpatialized=false, channelMask=0x0, sampleRate=0} 08-06 16:39:08.084233 3377 9757 D Telecom : h2: onPlaybackConfigChanged: config=AudioPlaybackConfiguration piid:2239 deviceIds:[] type:android.media.SoundPool u/pid:1000/17557 state:idle attr:AudioAttributes: usage=USAGE_ASSISTANCE_SONIFICATION content=CONTENT_TYPE_SONIFICATION flags=0x800 tags= bundle=null sessionId:0 mutedState:none FormatInfo{isSpatialized=false, channelMask=0x0, sampleRate=0} 08-06 16:39:08.084255 3377 9757 D Telecom : h2: onPlaybackConfigChanged: config=AudioPlaybackConfiguration piid:3647 deviceIds:[] type:android.media.MediaPlayer u/pid:10356/6308 state:idle attr:AudioAttributes: usage=USAGE_UNKNOWN content=CONTENT_TYPE_UNKNOWN flags=0x800 tags= bundle=null sessionId:10857 mutedState:none FormatInfo{isSpatialized=false, channelMask=0x0, sampleRate=0} 08-06 16:39:08.084337 3377 9757 D Telecom : h2: onPlaybackConfigChanged: config=AudioPlaybackConfiguration piid:1863 deviceIds:[] type:android.media.SoundPool u/pid:10161/4384 state:idle attr:AudioAttributes: usage=USAGE_ASSISTANCE_SONIFICATION content=CONTENT_TYPE_SONIFICATION flags=0x800 tags= bundle=null sessionId:0 mutedState:none FormatInfo{isSpatialized=false, channelMask=0x0, sampleRate=0} 08-06 16:39:08.084421 3377 9757 D Telecom : h2: onPlaybackConfigChanged: config=AudioPlaybackConfiguration piid:2375 deviceIds:[] type:android.media.SoundPool u/pid:10242/8287 state:idle attr:AudioAttributes: usage=USAGE_ASSISTANCE_SONIFICATION content=CONTENT_TYPE_SONIFICATION flags=0x800 tags= bundle=null sessionId:0 mutedState:none FormatInfo{isSpatialized=false, channelMask=0x0, sampleRate=0} 08-06 16:39:08.084448 3377 9757 D Telecom : h2: onPlaybackConfigChanged: config=AudioPlaybackConfiguration piid:4167 deviceIds:[] type:android.media.MediaPlayer u/pid:10373/6748 state:idle attr:AudioAttributes: usage=USAGE_UNKNOWN content=CONTENT_TYPE_UNKNOWN flags=0x800 tags= bundle=null sessionId:11417 mutedState:none FormatInfo{isSpatialized=false, channelMask=0x0, sampleRate=0} 08-06 16:39:08.084464 19578 19643 D MTS_BaseSceneDetector: [m]com.smile.gifmaker audioState: 10881 State: 4 08-06 16:39:08.084517 19578 19643 D MTS_BaseSceneDetector: [m]com.smile.gifmaker audioState: 11281 State: 2 08-06 16:39:08.084531 3377 9757 D Telecom : h2: onPlaybackConfigChanged: config=AudioPlaybackConfiguration piid:143 deviceIds:[] type:android.media.SoundPool u/pid:1000/3377 state:idle attr:AudioAttributes: usage=USAGE_ASSISTANCE_SONIFICATION content=CONTENT_TYPE_SONIFICATION flags=0x800 tags= bundle=null sessionId:0 mutedState:none FormatInfo{isSpatialized=false, channelMask=0x0, sampleRate=0} 08-06 16:39:08.084542 19578 19643 D MTS_BaseSceneDetector: [m]com.smile.gifmaker audioState: 10841 State: 3 08-06 16:39:08.084561 3377 9757 D Telecom : h2: onPlaybackConfigChanged: config=AudioPlaybackConfiguration piid:1487 deviceIds:[] type:android.media.SoundPool u/pid:10161/4384 state:idle attr:AudioAttributes: usage=USAGE_ASSISTANCE_SONIFICATION content=CONTENT_TYPE_SONIFICATION flags=0x800 tags= bundle=null sessionId:0 mutedState:none FormatInfo{isSpatialized=false, channelMask=0x0, sampleRate=0} 08-06 16:39:08.084585 3377 9757 D Telecom : h2: onPlaybackConfigChanged: config=AudioPlaybackConfiguration piid:4111 deviceIds:[] type:android.media.SoundPool u/pid:10104/730 state:idle attr:AudioAttributes: usage=USAGE_ASSISTANCE_SONIFICATION content=CONTENT_TYPE_SONIFICATION flags=0x800 tags= bundle=null sessionId:0 mutedState:none FormatInfo{isSpatialized=false, channelMask=0x0, sampleRate=0} 08-06 16:39:08.084605 3377 9757 D Telecom : h2: onPlaybackConfigChanged: config=AudioPlaybackConfiguration piid:4175 deviceIds:[] type:android.media.MediaPlayer u/pid:10373/6748 state:started attr:AudioAttributes: usage=USAGE_MEDIA content=CONTENT_TYPE_UNKNOWN flags=0x800 tags= bundle=null sessionId:11425 mutedState:none FormatInfo{isSpatialized=false, channelMask=0x0, sampleRate=0} 08-06 16:39:08.084635 3377 9757 D Telecom : h2: onPlaybackConfigChanged: config=AudioPlaybackConfiguration piid:151 deviceIds:[] type:android.media.SoundPool u/pid:10242/8287 state:idle attr:AudioAttributes: usage=USAGE_ASSISTANCE_SONIFICATION content=CONTENT_TYPE_SONIFICATION flags=0x800 tags= bundle=null sessionId:0 mutedState:none FormatInfo{isSpatialized=false, channelMask=0x0, sampleRate=0} 08-06 16:39:08.084660 3377 9757 D Telecom : h2: onPlaybackConfigChanged: config=AudioPlaybackConfiguration piid:1879 deviceIds:[] type:android.media.SoundPool u/pid:10145/21352 state:idle attr:AudioAttributes: usage=USAGE_ASSISTANCE_SONIFICATION content=CONTENT_TYPE_SONIFICATION flags=0x800 tags= bundle=null sessionId:0 mutedState:none FormatInfo{isSpatialized=false, channelMask=0x0, sampleRate=0} 08-06 16:39:08.084707 3377 9757 D Telecom : h2: onPlaybackConfigChanged: config=AudioPlaybackConfiguration piid:2007 deviceIds:[] type:android.media.SoundPool u/pid:10145/21352 state:idle attr:AudioAttributes: usage=USAGE_ASSISTANCE_SONIFICATION content=CONTENT_TYPE_SONIFICATION flags=0x800 tags= bundle=null sessionId:0 mutedState:none FormatInfo{isSpatialized=false, channelMask=0x0, sampleRate=0} 08-06 16:39:08.084759 3377 9757 D Telecom : h2: onPlaybackConfigChanged: config=AudioPlaybackConfiguration piid:3671 deviceIds:[2] type:android.media.MediaPlayer u/pid:10356/6308 state:stopped attr:AudioAttributes: usage=USAGE_MEDIA content=CONTENT_TYPE_UNKNOWN flags=0x800 tags= bundle=null sessionId:10881 mutedState:streamVolume portVolume FormatInfo{isSpatialized=false, channelMask=0x1, sampleRate=44100} 08-06 16:39:08.084779 3377 9757 D Telecom : h2: onPlaybackConfigChanged: config=AudioPlaybackConfiguration piid:4055 deviceIds:[] type:android.media.AudioTrack u/pid:10356/6308 state:idle attr:AudioAttributes: usage=USAGE_MEDIA content=CONTENT_TYPE_UNKNOWN flags=0xA00 tags= bundle=null sessionId:11265 mutedState:none FormatInfo{isSpatialized=false, channelMask=0x0, sampleRate=0} 08-06 16:39:08.084802 3377 9757 D Telecom : h2: onPlaybackConfigChanged: config=AudioPlaybackConfiguration piid:159 deviceIds:[] type:android.media.SoundPool u/pid:10242/8287 state:idle attr:AudioAttributes: usage=USAGE_ASSISTANCE_SONIFICATION content=CONTENT_TYPE_SONIFICATION flags=0x800 tags= bundle=null sessionId:0 mutedState:none FormatInfo{isSpatialized=false, channelMask=0x0, sampleRate=0} 08-06 16:39:08.084841 3377 9757 D Telecom : h2: onPlaybackConfigChanged: config=AudioPlaybackConfiguration piid:2783 deviceIds:[] type:android.media.SoundPool u/pid:1000/30442 state:idle attr:AudioAttributes: usage=USAGE_ASSISTANCE_SONIFICATION content=CONTENT_TYPE_SONIFICATION flags=0x800 tags= bundle=null sessionId:0 mutedState:none FormatInfo{isSpatialized=false, channelMask=0x0, sampleRate=0} 08-06 16:39:08.084867 3377 9757 D Telecom : h2: onPlaybackConfigChanged: config=AudioPlaybackConfiguration piid:231 deviceIds:[] type:android.media.SoundPool u/pid:10242/8287 state:idle attr:AudioAttributes: usage=USAGE_ASSISTANCE_SONIFICATION content=CONTENT_TYPE_SONIFICATION flags=0x800 tags= bundle=null sessionId:0 mutedState:none FormatInfo{isSpatialized=false, channelMask=0x0, sampleRate=0} 08-06 16:39:08.084889 3377 9757 D Telecom : h2: onPlaybackConfigChanged: config=AudioPlaybackConfiguration piid:295 deviceIds:[] type:android.media.SoundPool u/pid:10242/8287 state:idle attr:AudioAttributes: usage=USAGE_ASSISTANCE_SONIFICATION content=CONTENT_TYPE_SONIFICATION flags=0x800 tags= bundle=null sessionId:0 mutedState:none FormatInfo{isSpatialized=false, channelMask=0x0, sampleRate=0} 08-06 16:39:08.084909 3377 9757 D Telecom : h2: onPlaybackConfigChanged: config=AudioPlaybackConfiguration piid:2791 deviceIds:[] type:android.media.SoundPool u/pid:1000/30442 state:idle attr:AudioAttributes: usage=USAGE_ASSISTANCE_SONIFICATION content=CONTENT_TYPE_SONIFICATION flags=0x800 tags= bundle=null sessionId:0 mutedState:none FormatInfo{isSpatialized=false, channelMask=0x0, sampleRate=0} 08-06 16:39:08.084927 3377 9757 D Telecom : h2: onPlaybackConfigChanged: config=AudioPlaybackConfiguration piid:4071 deviceIds:[2] type:android.media.AudioTrack u/pid:10356/6308 state:started attr:AudioAttributes: usage=USAGE_MEDIA content=CONTENT_TYPE_UNKNOWN flags=0xA00 tags= bundle=null sessionId:11281 mutedState:clientVolume FormatInfo{isSpatialized=false, channelMask=0x3, sampleRate=44100} 08-06 16:39:08.084957 3377 9757 D Telecom : h2: onPlaybackConfigChanged: config=AudioPlaybackConfiguration piid:2735 deviceIds:[] type:android.media.SoundPool u/pid:10361/27907 state:idle attr:AudioAttributes: usage=USAGE_ASSISTANCE_SONIFICATION content=CONTENT_TYPE_SONIFICATION flags=0x800 tags= bundle=null sessionId:0 mutedState:none FormatInfo{isSpatialized=false, channelMask=0x0, sampleRate=0} 08-06 16:39:08.084984 3377 9757 D Telecom : h2: onPlaybackConfigChanged: config=AudioPlaybackConfiguration piid:3631 deviceIds:[] type:android.media.AudioTrack u/pid:10356/6308 state:paused attr:AudioAttributes: usage=USAGE_MEDIA content=CONTENT_TYPE_UNKNOWN flags=0xA00 tags= bundle=null sessionId:10841 mutedState:streamVolume portVolume FormatInfo{isSpatialized=false, channelMask=0x3, sampleRate=44100} 08-06 16:39:08.085000 3377 9757 D Telecom : h2: onPlaybackConfigChanged: config=AudioPlaybackConfiguration piid:3695 deviceIds:[] type:android.media.AudioTrack u/pid:10356/6308 state:idle attr:AudioAttributes: usage=USAGE_MEDIA content=CONTENT_TYPE_UNKNOWN flags=0xA00 tags= bundle=null sessionId:10905 mutedState:none FormatInfo{isSpatialized=false, channelMask=0x0, sampleRate=0} 08-06 16:39:08.085015 3377 9757 D Telecom : h2: onPlaybackConfigChanged: config=AudioPlaybackConfiguration piid:2295 deviceIds:[] type:android.media.SoundPool u/pid:10136/28604 state:idle attr:AudioAttributes: usage=USAGE_ASSISTANCE_SONIFICATION content=CONTENT_TYPE_SONIFICATION flags=0x800 tags= bundle=null sessionId:0 mutedState:none FormatInfo{isSpatialized=false, channelMask=0x0, sampleRate=0} 08-06 16:39:08.085036 3377 9757 D Telecom : h2: onPlaybackConfigChanged: config=AudioPlaybackConfiguration piid:2359 deviceIds:[] type:android.media.SoundPool u/pid:10339/27020 state:idle attr:AudioAttributes: usage=USAGE_ASSISTANCE_SONIFICATION content=CONTENT_TYPE_SONIFICATION flags=0x800 tags= bundle=null sessionId:0 mutedState:none FormatInfo{isSpatialized=false, channelMask=0x0, sampleRate=0} 08-06 16:39:08.085052 3377 9757 D Telecom : h2: onPlaybackConfigChanged: config=AudioPlaybackConfiguration piid:2423 deviceIds:[] type:android.media.SoundPool u/pid:10370/4607 state:idle attr:AudioAttributes: usage=USAGE_ASSISTANCE_SONIFICATION content=CONTENT_TYPE_SONIFICATION flags=0x801 tags= bundle=null sessionId:0 mutedState:none FormatInfo{isSpatialized=false, channelMask=0x0, sampleRate=0} 08-06 16:39:08.085074 3377 9757 D Telecom : h2: onPlaybackConfigChanged: config=AudioPlaybackConfiguration piid:3639 deviceIds:[] type:android.media.MediaPlayer u/pid:10356/6308 state:idle attr:AudioAttributes: usage=USAGE_UNKNOWN content=CONTENT_TYPE_UNKNOWN flags=0x800 tags= bundle=null sessionId:10849 mutedState:none FormatInfo{isSpatialized=false, channelMask=0x0, sampleRate=0} 08-06 16:39:08.085103 3377 9757 D Telecom : h2: onPlaybackConfigChanged: config=AudioPlaybackConfiguration piid:4087 deviceIds:[] type:android.media.MediaPlayer u/pid:10339/27020 state:idle attr:AudioAttributes: usage=USAGE_UNKNOWN content=CONTENT_TYPE_UNKNOWN flags=0x800 tags= bundle=null sessionId:11305 mutedState:none FormatInfo{isSpatialized=false, channelMask=0x0, sampleRate=0} 08-06 16:39:08.085120 3377 9757 D Telecom : h2: onPlaybackConfigChanged: config=AudioPlaybackConfiguration piid:2239 deviceIds:[] type:android.media.SoundPool u/pid:1000/17557 state:idle attr:AudioAttributes: usage=USAGE_ASSISTANCE_SONIFICATION content=CONTENT_TYPE_SONIFICATION flags=0x800 tags= bundle=null sessionId:0 mutedState:none FormatInfo{isSpatialized=false, channelMask=0x0, sampleRate=0} 08-06 16:39:08.085134 3377 9757 D Telecom : h2: onPlaybackConfigChanged: config=AudioPlaybackConfiguration piid:3647 deviceIds:[] type:android.media.MediaPlayer u/pid:10356/6308 state:idle attr:AudioAttributes: usage=USAGE_UNKNOWN content=CONTENT_TYPE_UNKNOWN flags=0x800 tags= bundle=null sessionId:10857 mutedState:none FormatInfo{isSpatialized=false, channelMask=0x0, sampleRate=0} 08-06 16:39:08.085843 19578 19643 D MTS_BaseSceneDetector: [m]com.smile.gifmaker audioState: 10881 State: 4 08-06 16:39:08.085892 19578 19643 D MTS_BaseSceneDetector: [m]com.smile.gifmaker audioState: 11281 State: 2 08-06 16:39:08.085913 19578 19643 D MTS_BaseSceneDetector: [m]com.smile.gifmaker audioState: 10841 State: 3 08-06 16:39:08.086281 2463 10083 D OplusNuPlayer: already disable oplus avenhancements decoders... 08-06 16:39:08.086298 2463 10083 D OplusNuPlayer: [instantiateDecoder:L574] codeID A:0 V:0 tryffmpeg A:0 V:0 08-06 16:39:08.087111 6748 9240 E KLog : [E] [Tid: 486288987328] [Daenerys][operator()][stats.h:240] last pts:69982187,frame_number:53,cost_time:0,thread_site:2 08-06 16:39:08.089982 19578 19643 W MTS_BaseSceneDetectorFactory: [m]illegal pkgName: com.kuaishou.nebula 08-06 16:39:08.090065 19578 19643 W MTS_AppSceneDetector: [m]create detector fail 08-06 16:39:08.090095 19578 19643 W MTS_AppSceneDetector: [m]detect play change when get detector is null, uid: 10373 08-06 16:39:08.093672 1793 3489 I AHAL: AudioDevice: GetParameters: 3018: enter: is_hw_dec_session_available 08-06 16:39:08.094676 6748 10054 D MediaCodec: [0xb4000070b0571800] setState: 5 08-06 16:39:08.094924 2463 10096 D MediaCodec: CreateByType: mime audio/vorbis, encoder 0, pid 6748 08-06 16:39:08.095213 6748 9244 I KLog : [I] [Tid: 485694878912] MediaRecorderImpl| onCaptureOneVideoFrame 08-06 16:39:08.095264 6748 9244 I KLog : [I] [Tid: 485694878912] CaptureImageController| onPreviewCaptured main bitmap 0 true w*h:996*1920 08-06 16:39:08.095280 6748 9244 I KLog : [I] [Tid: 485694878912] CaptureImageController| main mediaRecorder didFinishCaptureImage 08-06 16:39:08.095392 14336 14336 I mydevices[core].AudioPlaybackMonitor: (main)notifyPlaybackConfigChanged 08-06 16:39:08.095421 10098 10171 I midasd : OplusObrainService::notifyEventIntString eventId:14 iParam:2 strParam:com.kuaishou.nebula 08-06 16:39:08.095660 2463 10096 W libc : Access denied finding property "vendor.debug.stagefright.mediacodec.trace" 08-06 16:39:08.095694 14336 14336 I mydevices[core].AudioPlaybackMonitor: (main)checkPlaybackChanged 08-06 16:39:08.095784 2463 10096 W libc : Access denied finding property "persist.vendor.media.c2.frameworks.buffercount.trace" 08-06 16:39:08.095809 2463 10096 W libc : Access denied finding property "persist.vendor.media.c2.frameworks.buffercount.trace" 08-06 16:39:08.096314 2463 10096 W libc : Access denied finding property "persist.vendor.media.c2.frameworks.buffercount.trace" 08-06 16:39:08.096343 2463 10096 W libc : Access denied finding property "persist.vendor.media.c2.frameworks.buffercount.trace" 08-06 16:39:08.096386 2463 10096 D MediaCodec: [0xb400007c5f5cd800] init: CCodec 0xb400007c57437700, CCodecBufferChannel 0xb400007c7a547018 08-06 16:39:08.096514 2463 10100 D MediaCodec: [0xb400007c5f5cd800] setState: 1 08-06 16:39:08.096561 2463 10100 D CCodec : allocate(c2.android.vorbis.decoder) 08-06 16:39:08.097251 2448 9903 I OplusCameraService: CameraServiceExtImpl.cpp: 5082 getTrdPartyFBJsonValue() getTrdPartyFBJsonValue apkPropName: oplus.video.beauty.com.kuaishou.nebula, prop value: -1 08-06 16:39:08.097270 6748 10080 I KLog : [I] [Tid: 488912553152] FaceMagicLog jni : nativeGetFaceMagicInfo 08-06 16:39:08.097467 12585 32752 I OplusObrain: OplusObrainClientInvoke.nativeGetAudioPackageList 08-06 16:39:08.099245 1865 4191 W QC2Interface: [avcE_712] Failed to query parameters 08-06 16:39:08.101375 1858 1968 I [UAH_CLIENT]: UahPlatformResAcquire 08-06 16:39:08.101405 1858 1968 I [UAH_CLIENT]: UahEventAcquire, cmdid:-3, pkg:1865 4191, identity:qcom-perfd 08-06 16:39:08.101865 2044 2075 I URCC_CORE_SERVER: [urccRequestQueueExec] urccRequest: handle: 117196, uz3M9x5&*ibde*fiai#*79yy5s&*t7vx-u5s46#*6ps9q1vw&*hjj#*us1v&*h#*r916&*wvw5#*sr&i#*s5r&*^jmijijjij#fjaejjj$ 08-06 16:39:08.102267 2044 2075 I URCC_RES_MANAGER: [dumpResourceApplyInfo] urccResUpdate: XKF&^iiciad#jmij#iahjjjj#jmjb$ 08-06 16:39:08.102321 2044 2075 I URCC_RES_MANAGER: [dumpCpuOnline] urccCoreCtrl: [0x1010b90,2,191919,-1] [0x1010ba0,3,191919,-1] [0x1010bb0,1,191919,-1] [0x1010bc0,2,191919,-1] 08-06 16:39:08.102455 1858 1966 E ANDR-PERF-RESOURCEQS: ANDR-PERF-RESOURCEQS: AddAndApply() 125: Resource with major=16, minor=0 not supported 08-06 16:39:08.111151 2463 10100 I CCodec : setting up 'default' as default (vendor) store 08-06 16:39:08.111589 6748 6748 D MediaRouter: onRestoreRoute() : route=RouteInfo{ name=手机, description=null, status=null, category=RouteCategory{ name=系统 types=ROUTE_TYPE_LIVE_AUDIO ROUTE_TYPE_LIVE_VIDEO groupable=false }, supportedTypes=ROUTE_TYPE_LIVE_AUDIO ROUTE_TYPE_LIVE_VIDEO , presentationDisplay=null } 08-06 16:39:08.111680 6748 6748 V MediaRouter: Selecting route: RouteInfo{ name=手机, description=null, status=null, category=RouteCategory{ name=系统 types=ROUTE_TYPE_LIVE_AUDIO ROUTE_TYPE_LIVE_VIDEO groupable=false }, supportedTypes=ROUTE_TYPE_LIVE_AUDIO ROUTE_TYPE_LIVE_VIDEO , presentationDisplay=null } 08-06 16:39:08.118992 2833 18779 D BufferPoolAccessor2.0: bufferpool2 0xb4000074ba52d428 : 0(0 size) total buffers - 0(0 size) used buffers - 0/0 (recycle/alloc) - 0/0 (fetch/transfer) 08-06 16:39:08.119117 2833 18779 D BufferPoolAccessor2.0: bufferpool2 0xb4000074ba52c828 : 0(0 size) total buffers - 0(0 size) used buffers - 287/334 (recycle/alloc) - 43/294 (fetch/transfer) 08-06 16:39:08.119144 2463 16838 D BufferPoolAccessor2.0: bufferpool2 0xb400007c7a51f628 : 0(0 size) total buffers - 0(0 size) used buffers - 37/45 (recycle/alloc) - 8/86 (fetch/transfer) 08-06 16:39:08.119210 10098 10171 I midasd : OplusObrainService::notifyEventInt eventId:21 iParam:0 08-06 16:39:08.119269 2463 16838 D BufferPoolAccessor2.0: Destruction - bufferpool2 0xb400007c7a51f628 cached: 0/0M, 0/0% in use; allocs: 45, 82% recycled; transfers: 86, 91% unfetched 08-06 16:39:08.119494 1865 10112 W IMGTXRFILTER: [imgTxrF_712] Client has not specified color aspects, setting default for format -1040187392(RGBA8888_UBWC) 08-06 16:39:08.120408 1865 10114 E CVPFilter: [cvpF_712] start: Eva-Dme object couldn't be constructed! Bypass it 08-06 16:39:08.121769 12585 32752 I OplusObrain: OplusObrainClientInvoke.nativeGetTelephonyInfo 08-06 16:39:08.122279 12585 32752 I OplusObrain: OplusObrainClientInvoke.nativeGetTrafficTypeInfoForNetworkType networkType 0 08-06 16:39:08.122459 3377 9118 D KernelStatsHelper: getKernelStats start! 08-06 16:39:08.124521 2463 10100 I CCodec : Created component [c2.android.vorbis.decoder] for [c2.android.vorbis.decoder] 08-06 16:39:08.124547 2463 10100 D CCodecBufferChannel: [0xb400007c7a547018] setComponent: mName c2.android.vorbis.decoder#444, mPipelineWatcher 0xb400007c7a547500 08-06 16:39:08.124771 2463 10100 D CCodecConfig: read media type: audio/vorbis 08-06 16:39:08.125442 6748 6937 I Ktrace : trace manager create trace with span name 0xb400007247d3c960. 08-06 16:39:08.126590 6748 6937 I Ktrace : Host internal: ReportEvent 08-06 16:39:08.127427 2463 10100 D ReflectedParamUpdater: extent() != 1 for single value type: algo.buffers.max-count.values 08-06 16:39:08.128410 2463 10100 D ReflectedParamUpdater: extent() != 1 for single value type: output.subscribed-indices.values 08-06 16:39:08.128503 2463 10100 D ReflectedParamUpdater: extent() != 1 for single value type: input.buffers.allocator-ids.values 08-06 16:39:08.128570 2463 10100 D ReflectedParamUpdater: extent() != 1 for single value type: output.buffers.allocator-ids.values 08-06 16:39:08.128621 2463 10100 D ReflectedParamUpdater: extent() != 1 for single value type: algo.buffers.allocator-ids.values 08-06 16:39:08.128656 2463 10100 D ReflectedParamUpdater: extent() != 1 for single value type: output.buffers.pool-ids.values 08-06 16:39:08.128689 2463 10100 D ReflectedParamUpdater: extent() != 1 for single value type: algo.buffers.pool-ids.values 08-06 16:39:08.129298 2463 10100 I CCodecConfig: query failed after returning 8 values (BAD_INDEX) 08-06 16:39:08.129350 2448 9903 I OplusCameraService: CameraServiceExtImpl.cpp: 5082 getTrdPartyFBJsonValue() getTrdPartyFBJsonValue apkPropName: oplus.video.beauty.com.kuaishou.nebula, prop value: -1 08-06 16:39:08.129529 2463 10100 D MediaCodec: [0xb400007c5f5cd800] setState: 2 08-06 16:39:08.130283 6748 9223 I KLog : [I] [Tid: 489411302592] [Daenerys][operator()][runloop_processor.h:42] RunloopProcessor frame dropped from_input:1,frame_number:56,pts:69982287 08-06 16:39:08.131641 1249 1249 E lowmemorykiller: device memory 820800 free 60206 file 711926 08-06 16:39:08.131757 3377 8080 D OplusNetlinkSocket: handleNetlinkRecvKernelMessage:nlmsghdr:StructNlMsgHdr{ nlmsg_len{3004}, nlmsg_type{49()}, nlmsg_flags{0()}, nlmsg_seq{0}, nlmsg_pid{221323152} } 08-06 16:39:08.133231 3377 8080 D KernelStatsHelper: get magic :[-1, -1, -1, 77, 65, 71, 73, 67] 08-06 16:39:08.133250 3377 8080 D KernelStatsHelper: magic matched count:86 data_len:4472 08-06 16:39:08.133343 3377 8080 D OplusNetlinkSocket: handleNetlinkRecvKernelMessage:nlmsghdr:StructNlMsgHdr{ nlmsg_len{1532}, nlmsg_type{49()}, nlmsg_flags{0()}, nlmsg_seq{0}, nlmsg_pid{221323152} } 08-06 16:39:08.133357 3377 8080 D KernelStatsHelper: data over! check: true 08-06 16:39:08.135275 1865 4191 W QC2Interface: [avcE_712] Failed to query parameters 08-06 16:39:08.135475 1858 1968 I [UAH_CLIENT]: UahRelease, handle:117196 08-06 16:39:08.135797 2044 2075 I URCC_CORE_SERVER: [urccRequestReleaseExec] urccRelease: handle: 117196, said:-1 08-06 16:39:08.136227 2044 2075 I URCC_RES_MANAGER: [dumpResourceApplyInfo] urccResUpdate: XKF&^iicjeg#jmij#dchjjj#jmjj$ 08-06 16:39:08.137655 2463 10096 W ServiceManagerCppClient: Failed to get isDeclared for media_quality: Status(-1, EX_SECURITY): 'SELinux denied for service.' 08-06 16:39:08.137699 2463 10096 E MediaCodec: Media Quality Service not found. 08-06 16:39:08.137803 2463 10096 I MediaCodec: [0xb400007c5f5cd800] [c2.android.vorbis.decoder] configure, format : AMessage(what = 0x00000000) = { string mime = "audio/vorbis" int64_t durationUs = 139546 Buffer csd-0 = { 00000000: 01 76 6f 72 62 69 73 00 00 00 00 01 44 ac 00 00 .vorbis.....D... 00000010: 00 00 00 00 70 11 01 00 00 00 00 00 b8 01 ....p......... } Buffer *csd-1 = 0xb400007c74118100 int32_t bitrate = 70000 int32_t channel-count = 1 int32_t sample-rate = 44100 int32_t channel-mask = 1 int32_t priority = 0 int32_t pcm-encoding = 2 int32_t dataSourceType = 5 int64_t calling-uid = 10373 int64_t calling-pid = 6748 int32_t vendor.qti-ext-dec-drop-corrupt.value = 1 } 日志解释
08-12
评论
成就一亿技术人!
拼手气红包6.0元
还能输入1000个字符
 
红包 添加红包
表情包 插入表情
 条评论被折叠 查看
添加红包

请填写红包祝福语或标题

红包个数最小为10个

红包金额最低5元

当前余额3.43前往充值 >
需支付:10.00
成就一亿技术人!
领取后你会自动成为博主和红包主的粉丝 规则
hope_wisdom
发出的红包
实付
使用余额支付
点击重新获取
扫码支付
钱包余额 0

抵扣说明:

1.余额是钱包充值的虚拟货币,按照1:1的比例进行支付金额的抵扣。
2.余额无法直接购买下载,可以购买VIP、付费专栏及课程。

余额充值